Skip to content

Commit

Permalink
This commit does not belong to any branch on this repository, and may belong to a fork outside of the repository.
avoid scoped targets in hopes it will build on Galactic
Browse files Browse the repository at this point in the history
berndpfrommer committed Mar 26, 2024
1 parent 48af35c commit 6ca6a4d
Showing 1 changed file with 4 additions and 4 deletions.
8 changes: 4 additions & 4 deletions spinnaker_camera_driver/CMakeLists.txt
Original file line number Diff line number Diff line change
@@ -106,10 +106,10 @@ add_library(camera_driver SHARED
# ament_target_dependencies(camera_driver PUBLIC ${ROS_DEPENDENCIES})
target_link_libraries(camera_driver
PUBLIC
rclcpp::rclcpp
rclcpp_components::component
camera_info_manager::camera_info_manager
image_transport::image_transport
${rclcpp_TARGETS} # rclcpp::rclcpp only works for >= Humble
${rclcpp_components_TARGETS}
${camera_info_manager_TARGETS}
${image_transport_TARGETS}
${flir_camera_msgs_TARGETS}
${sensor_msgs_TARGETS}
${std_msgs_TARGETS}

0 comments on commit 6ca6a4d

Please sign in to comment.