Skip to content

Commit a24b7da

Browse files
authored
Update ros2_launch_gazebo.md with remapping topic fix. Didn't have topic to be remapped. (#560)
Signed-off-by: David Dorf <[email protected]>
1 parent ccfda52 commit a24b7da

File tree

1 file changed

+2
-1
lines changed

1 file changed

+2
-1
lines changed

harmonic/ros2_launch_gazebo.md

Lines changed: 2 additions & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -93,7 +93,8 @@ def generate_launch_description():
9393
package='ros_gz_bridge',
9494
executable='parameter_bridge',
9595
arguments=['/example_imu_topic@sensor_msgs/msg/[email protected]',],
96-
remappings=[('/remapped_imu_topic'),],
96+
remappings=[('/example_imu_topic',
97+
'/remapped_imu_topic'),],
9798
output='screen'
9899
),
99100
])

0 commit comments

Comments
 (0)