[ros-users] [Discourse.ros.org] [MoveIt!] Moveit! motion planning issue

Mike Lautman via Discourse.ros.org ros.discourse at gmail.com
Mon Feb 4 20:03:49 UTC 2019



If I understand your question correctly, you want to append a robotiq gripper trajectory at the end of your ur5 robot trajectory. This shouldn't be a problem since the [moveit trajectory execution manager](https://github.com/ros-planning/moveit/blob/melodic-devel/moveit_ros/planning/trajectory_execution_manager/include/moveit/trajectory_execution_manager/trajectory_execution_manager.h) takes in a [moveit_msgs/RobotTrajectory](http://docs.ros.org/melodic/api/moveit_msgs/html/msg/RobotTrajectory.html) which simply maps the trajectory for each joint in joint_names to an appropriate controller for that joint. 

In the video that you provide, it is unclear what you are displaying, please include the rviz displays side panel. If you are able to see the robot moving with only the planning_scene robot visualized, then you are on the right track. If you are instead just displaying the published joint trajectory, then you need to look into how you are connecting to gazebo.





---
[Visit Topic](https://discourse.ros.org/t/moveit-motion-planning-issue/7641/6) or reply to this email to respond.




More information about the ros-users mailing list