File tree Expand file tree Collapse file tree 1 file changed +22
-3
lines changed Expand file tree Collapse file tree 1 file changed +22
-3
lines changed Original file line number Diff line number Diff line change @@ -26,15 +26,34 @@ include_directories(
26
26
27
27
# encoder
28
28
add_executable (encoder_test src/my_encoder.cpp )
29
- ament_target_dependencies (encoder_test point_cloud_transport rosbag2_cpp sensor_msgs )
29
+
30
+ target_link_libraries (encoder_test PUBLIC
31
+ ${sensor_msgs_TARGETS}
32
+ point_cloud_transport::point_cloud_transport
33
+ rosbag2_cpp::rosbag2_cpp
34
+ sensor_msgs::sensor_msgs_library
35
+ )
36
+
30
37
31
38
# publisher
32
39
add_executable (publisher_test src/my_publisher.cpp )
33
- ament_target_dependencies (publisher_test point_cloud_transport rclcpp rcpputils rosbag2_cpp sensor_msgs )
40
+ target_link_libraries (publisher_test PUBLIC
41
+ ${sensor_msgs_TARGETS}
42
+ point_cloud_transport::point_cloud_transport
43
+ rclcpp::rclcpp
44
+ rosbag2_cpp::rosbag2_cpp
45
+ sensor_msgs::sensor_msgs_library
46
+ )
47
+
34
48
35
49
# subscriber
36
50
add_executable (subscriber_test src/my_subscriber.cpp )
37
- ament_target_dependencies (subscriber_test point_cloud_transport rclcpp sensor_msgs )
51
+ target_link_libraries (subscriber_test PUBLIC
52
+ ${sensor_msgs_TARGETS}
53
+ point_cloud_transport::point_cloud_transport
54
+ rclcpp::rclcpp
55
+ sensor_msgs::sensor_msgs_library
56
+ )
38
57
39
58
# Install executables
40
59
install (
You can’t perform that action at this time.
0 commit comments