Skip to content

Commit

Permalink
Address reviewer feedback
Browse files Browse the repository at this point in the history
Signed-off-by: Michael Carroll <michael@openrobotics.org>
  • Loading branch information
mjcarroll committed Oct 11, 2022
1 parent be17cb8 commit 5327ec9
Show file tree
Hide file tree
Showing 2 changed files with 4 additions and 3 deletions.
6 changes: 3 additions & 3 deletions ros_gz_sim/launch/gz_sim.launch.py.in
Original file line number Diff line number Diff line change
Expand Up @@ -54,7 +54,6 @@ def launch_gz(context, *args, **kwargs):
else:
debug_prefix = None


return [ExecuteProcess(
cmd=[exec, exec_args, '--force-version', gz_version],
output='screen',
Expand All @@ -67,10 +66,11 @@ def launch_gz(context, *args, **kwargs):
def generate_launch_description():
return LaunchDescription([
DeclareLaunchArgument('gz_args', default_value='',
description='Arguments to be passed to Gazebo Sim'),
description='Arguments to be passed to Gazebo Sim'),
# Gazebo Sim's major version
DeclareLaunchArgument('gz_version', default_value='@GZ_SIM_VER@',
description='Gazebo Sim\'s major version'),
description='Gazebo Sim\'s major version'),

# TODO(CH3): Deprecated. Remove on tock.
DeclareLaunchArgument(
'ign_args', default_value='',
Expand Down
1 change: 1 addition & 0 deletions ros_gz_sim/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -13,6 +13,7 @@
<buildtool_depend>ament_cmake</buildtool_depend>
<buildtool_depend>pkg-config</buildtool_depend>

<depend>ament_index_python</depend>
<depend>libgflags-dev</depend>
<depend>rclcpp</depend>
<depend>std_msgs</depend>
Expand Down

0 comments on commit 5327ec9

Please sign in to comment.