Skip to content

Commit

Permalink
Update ros2_launch_gazebo.md with remapping topic fix. Didn't have to…
Browse files Browse the repository at this point in the history
…pic to be remapped. (#560)

Signed-off-by: David Dorf <113081373+david-dorf@users.noreply.github.com>
  • Loading branch information
david-dorf authored Jan 8, 2025
1 parent ccfda52 commit a24b7da
Showing 1 changed file with 2 additions and 1 deletion.
3 changes: 2 additions & 1 deletion harmonic/ros2_launch_gazebo.md
Original file line number Diff line number Diff line change
Expand Up @@ -93,7 +93,8 @@ def generate_launch_description():
package='ros_gz_bridge',
executable='parameter_bridge',
arguments=['/example_imu_topic@sensor_msgs/msg/Imu@gz.msgs.IMU',],
remappings=[('/remapped_imu_topic'),],
remappings=[('/example_imu_topic',
'/remapped_imu_topic'),],
output='screen'
),
])
Expand Down

0 comments on commit a24b7da

Please sign in to comment.