From 9ee7a9d5324d3ff96722f0faea9a8567682272df Mon Sep 17 00:00:00 2001 From: CihatAltiparmak Date: Thu, 15 Aug 2024 10:12:36 +0300 Subject: [PATCH] Removed unnecessary quotations from CMakeLists.txt (#29) --- CMakeLists.txt | 26 +++++++++++++------------- 1 file changed, 13 insertions(+), 13 deletions(-) diff --git a/CMakeLists.txt b/CMakeLists.txt index ac991b4..3990151 100644 --- a/CMakeLists.txt +++ b/CMakeLists.txt @@ -25,13 +25,13 @@ add_executable( ament_target_dependencies( scenario_perception_pipeline_benchmark_main PUBLIC - "moveit_ros_planning_interface" - "rclcpp" - "benchmark" - "dynmsg" - "nav_msgs" - "yaml-cpp" - "example_interfaces") + moveit_ros_planning_interface + rclcpp + benchmark + dynmsg + nav_msgs + yaml-cpp + example_interfaces) target_include_directories( scenario_perception_pipeline_benchmark_main @@ -39,7 +39,7 @@ target_include_directories( $) target_link_libraries(scenario_perception_pipeline_benchmark_main - PUBLIC "benchmark::benchmark" ${YAML_CPP_LIBRARIES}) + PUBLIC benchmark::benchmark ${YAML_CPP_LIBRARIES}) add_executable( scenario_basic_service_client_benchmark_main @@ -49,11 +49,11 @@ add_executable( ament_target_dependencies( scenario_basic_service_client_benchmark_main PUBLIC - "moveit_ros_planning_interface" - "rclcpp" - "benchmark" - "std_msgs" - "example_interfaces") + moveit_ros_planning_interface + rclcpp + benchmark + std_msgs + example_interfaces) target_include_directories( scenario_basic_service_client_benchmark_main