gazebosim / ros_gz

Integration between ROS (1 and 2) and Gazebo simulation
https://gazebosim.org
Apache License 2.0
233 stars 135 forks source link

JointStates bridge failing for ROS2 Humble with Gazebo Garden #558

Closed rokasgie closed 2 months ago

rokasgie commented 4 months ago

Environment

Description

Steps to reproduce

  1. ros2 run ros_gz_bridge parameter_bridge /my/joint_states@std_msgs/msg/JointState@gz.msgs.Model

Output

ros_gz_bridge]: Creating GZ->ROS Bridge: [/my/joint_states (gz.msgs.Model) -> /my/joint_states (std_msgs/msg/JointState)] (Lazy 0) [WARN] [1717448826.963089241] [ros_gz_bridge]: Failed to create a bridge for topic [/my/joint_states] with ROS2 type [std_msgs/msg/JointState] to topic [/my/joint_states] with Gazebo Transport type [gz.msgs.Model]

azeey commented 2 months ago

The JointState message is in sensor_msgs not std_msgs, so your command should be ros2 run ros_gz_bridge parameter_bridge /my/joint_states@sensor_msgs/msg/JointState@gz.msgs.Model. I'll go ahead and close this, but feel free to reopen if you still the issue.