Robotics StackExchange | Archived questions

Gazebo plug-in to control DOF robot with PoseStamped

hi everyone,

is there an equivalent of the libgazebo_ros_joint_pose_trajectory.so/JointStates plugin
that can be used for the PoseStamped message on the /movebasesimple Topic to control a DOF type robot?

If not --- --- then which packages are required for a DOF type robot in Gazebo to react to published PoseStamped goal by sending this command?

ros2 topic pub /move_base_simple/goal geometry_msgs/PoseStamped '{ header: { frame_id: "world"}, pose: { position: { x: 0.4, y: 0.7 }, orientation: { x: 0, y: 0, z: 0, w: 1 } } }'

thanks for all/any suggestions!

Asked by user21307 on 2021-04-26 09:04:50 UTC

Comments

Answers