Skip to content

Commit

Permalink
Format code
Browse files Browse the repository at this point in the history
  • Loading branch information
FelipeGdM committed Dec 8, 2023
1 parent 9be6dfe commit d688bc7
Showing 1 changed file with 8 additions and 3 deletions.
11 changes: 8 additions & 3 deletions rviz_carla_plugin/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -74,9 +74,14 @@ elseif(${ROS_VERSION} EQUAL 2)
pluginlib_export_plugin_description_file(rviz_common
plugin_description_ros2.xml)

ament_target_dependencies(rviz_carla_plugin rclcpp carla_msgs nav_msgs
carla_ros_scenario_runner_types rviz_common
tf2_geometry_msgs)
ament_target_dependencies(
rviz_carla_plugin
rclcpp
carla_msgs
nav_msgs
carla_ros_scenario_runner_types
rviz_common
tf2_geometry_msgs)

ament_export_libraries(${PROJECT_NAME})

Expand Down

0 comments on commit d688bc7

Please sign in to comment.