We read every piece of feedback, and take your input very seriously.
To see all available qualifiers, see our documentation.
1 parent db3ae60 commit 2ebf6f0Copy full SHA for 2ebf6f0
source/Tutorials/Advanced/Simulators/Gazebo/Gazebo.rst
@@ -197,7 +197,7 @@ This topic will be available under the topic ``/lidar_scan``:
197
.. code-block:: console
198
199
$ 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
+ $ ros2 run ros_gz_bridge parameter_bridge /lidar2@sensor_msgs/msg/LaserScan@ignition.msgs.LaserScan --ros-args -r /lidar2:=/laser_scan
201
202
To visualize the data from the lidar in ROS 2 you can use Rviz2:
203
0 commit comments