Skip to content

Commit 2ebf6f0

Browse files
Fix ros_gz_bridge parameter_bridge command syntax (#3761)
The command was using '[' instead of '@' as the separator between ROS and Gazebo message types, causing a 'bad pattern' error.
1 parent db3ae60 commit 2ebf6f0

File tree

1 file changed

+1
-1
lines changed
  • source/Tutorials/Advanced/Simulators/Gazebo

1 file changed

+1
-1
lines changed

source/Tutorials/Advanced/Simulators/Gazebo/Gazebo.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -197,7 +197,7 @@ This topic will be available under the topic ``/lidar_scan``:
197197
.. code-block:: console
198198
199199
$ source /opt/ros/{DISTRO}/setup.bash
200-
$ ros2 run ros_gz_bridge parameter_bridge /lidar2@sensor_msgs/msg/LaserScan[ignition.msgs.LaserScan --ros-args -r /lidar2:=/laser_scan
200+
$ ros2 run ros_gz_bridge parameter_bridge /lidar2@sensor_msgs/msg/LaserScan@ignition.msgs.LaserScan --ros-args -r /lidar2:=/laser_scan
201201
202202
To visualize the data from the lidar in ROS 2 you can use Rviz2:
203203

0 commit comments

Comments
 (0)