From d688bc7b80aed0cf9b35538f11e442c3d9a49d49 Mon Sep 17 00:00:00 2001 From: Felipe Gomes de Melo Date: Fri, 8 Dec 2023 13:36:43 -0300 Subject: [PATCH] Format code --- rviz_carla_plugin/CMakeLists.txt | 11 ++++++++--- 1 file changed, 8 insertions(+), 3 deletions(-) diff --git a/rviz_carla_plugin/CMakeLists.txt b/rviz_carla_plugin/CMakeLists.txt index e90018ef..eac31da5 100644 --- a/rviz_carla_plugin/CMakeLists.txt +++ b/rviz_carla_plugin/CMakeLists.txt @@ -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})