Skip to content

Commit

Permalink
Removed some forgotten quotations
Browse files Browse the repository at this point in the history
  • Loading branch information
CihatAltiparmak committed Aug 18, 2024
1 parent b4474e3 commit d8163b1
Showing 1 changed file with 3 additions and 3 deletions.
6 changes: 3 additions & 3 deletions CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -61,7 +61,7 @@ target_include_directories(
$<BUILD_INTERFACE:${CMAKE_CURRENT_SOURCE_DIR}/include>)

target_link_libraries(scenario_basic_service_client_benchmark_main
PUBLIC "benchmark::benchmark" ${YAML_CPP_LIBRARIES})
PUBLIC benchmark::benchmark ${YAML_CPP_LIBRARIES})

add_executable(
scenario_basic_subscription_benchmark_main
Expand All @@ -70,15 +70,15 @@ add_executable(

ament_target_dependencies(
scenario_basic_subscription_benchmark_main PUBLIC
"moveit_ros_planning_interface" "rclcpp" "benchmark" "std_msgs")
moveit_ros_planning_interface rclcpp benchmark std_msgs)

target_include_directories(
scenario_basic_subscription_benchmark_main
PUBLIC $<INSTALL_INTERFACE:include>
$<BUILD_INTERFACE:${CMAKE_CURRENT_SOURCE_DIR}/include>)

target_link_libraries(scenario_basic_subscription_benchmark_main
PUBLIC "benchmark::benchmark" ${YAML_CPP_LIBRARIES})
PUBLIC benchmark::benchmark ${YAML_CPP_LIBRARIES})

add_executable(scenario_basic_subscription_basic_topic_publisher
src/scenarios/basic_topic_sub_pub/basic_topic_publisher.cpp)
Expand Down

0 comments on commit d8163b1

Please sign in to comment.