Skip to content

Commit

Permalink
fix link to Gazebo-ROS2 bridge + CLI examples (#3139) (#3142)
Browse files Browse the repository at this point in the history
* fix link to Gazebo-ROS2 bridge + CLI examples

Co-authored-by: Chris Lalancette <clalancette@gmail.com>
(cherry picked from commit da871ef)

Co-authored-by: Sergei Sergienko <divelix1@gmail.com>
  • Loading branch information
mergify[bot] and Divelix authored Oct 27, 2022
1 parent 1bc97e9 commit 32f6c52
Showing 1 changed file with 1 addition and 1 deletion.
2 changes: 1 addition & 1 deletion source/Tutorials/Advanced/Simulators/Ignition.rst
Original file line number Diff line number Diff line change
Expand Up @@ -116,7 +116,7 @@ In particular you are going to create a bridge for the topic ``/model/vehicle_bl
source /opt/ros/{DISTRO}/setup.bash
ros2 run ros_ign_bridge parameter_bridge /model/vehicle_blue/cmd_vel@geometry_msgs/msg/Twist]ignition.msgs.Twist
For more details about the ``ros_ign_bridge`` please check this `README <https://github.com/ignitionrobotics/ros_ign/tree/ros2/ros_ign_bridge>`__ .
For more details about the ``ros_ign_bridge`` please check this `README <https://github.com/gazebosim/ros_gz/tree/ros2/ros_gz_bridge>`__ .

Once the bridge is running the robot is able to follow your motor commands.
There are two options:
Expand Down

0 comments on commit 32f6c52

Please sign in to comment.