From a24b7daeaf594809ed9f48c796fc3b1cfa1afe18 Mon Sep 17 00:00:00 2001 From: David Dorf <113081373+david-dorf@users.noreply.github.com> Date: Wed, 8 Jan 2025 16:18:24 -0500 Subject: [PATCH] Update ros2_launch_gazebo.md with remapping topic fix. Didn't have topic to be remapped. (#560) Signed-off-by: David Dorf <113081373+david-dorf@users.noreply.github.com> --- harmonic/ros2_launch_gazebo.md | 3 ++- 1 file changed, 2 insertions(+), 1 deletion(-) diff --git a/harmonic/ros2_launch_gazebo.md b/harmonic/ros2_launch_gazebo.md index 7ad5fc97a..43d157b88 100644 --- a/harmonic/ros2_launch_gazebo.md +++ b/harmonic/ros2_launch_gazebo.md @@ -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' ), ])