Your browser does not seem to support JavaScript. As a result, your viewing experience will be diminished, and you have been placed in read-only mode.
Please download a browser that supports JavaScript, or enable it if it's disabled (i.e. NoScript).
O
@1980995256 是一次性给一系列点进行规划执行,还是说会实时动态的更新位姿点进行控制呢?
9
@小鱼 通过“git clone https://github.com/ros-planning/moveit2_tutorials -b foxy ” clone下来的代码
尚无回复
1
@2718936767 你好,请问解决了吗,我的机械臂也是左右不能规划成功,而且每次都是0.5的覆盖率
老哥,能不能给个联系方式,我也遇到这个问题了
小
@Gene 那可以把末端一部分在规划中忽略掉,目前能想到比较好的办法就是这个了
2
@小鱼 官方的教程连接如下 https://ros-planning.github.io/moveit_tutorials/doc/pilz_industrial_motion_planner/pilz_industrial_motion_planner.html
在文中描述使用的是 “This package uses moveit_msgs::MotionPlanRequest and moveit_msgs::MotionPlanResponse as input and output for motion planning.” 意思是使用moveit_msgs::MotionPlanReques作为输入,但是找不到对应的函数来接受这个消息类型,或者是对应的Server和Action也未指明。
文中给出了一个python的代码示例,但是想使用C++来实现对这个运动规划库的调用
7
@小鱼 谢谢 这个问题我已经解决啦 是stl加密的问题。
A
@zyg_sddy 同样的问题,哥们解决了吗
@1050604526 在 ROS MELODIC moveit在python3使用或msg在python2 与python3传递 中说:
instance has no attribute 'getitem'
贴一下全部错误,哪一行报错
4
您好,请问解决了吗,我现在也是这样
空
@空白 找到了,在MotionPlanning->Scene Robot里的Show Trail里面
@1498807307 了解下vscode自动补全的原理就知道了,vscode是通过读取pythonpath环境变量搜索的包,所以你把对应的包添加到pythonoython中应该就可以解决. 关于pythonpath相关知识请参考
https://fishros.com/d2lros2/#/humble/chapt2/basic/5.Python依赖查找流程
@577478126 那给我的感觉很像视觉伺服,你可以看看这篇文章: https://blog.csdn.net/banzhuan133/article/details/90723075
1f3525c3-30c4-4b42-8852-073855fd2682-image.png