File tree Expand file tree Collapse file tree 1 file changed +7
-2
lines changed Expand file tree Collapse file tree 1 file changed +7
-2
lines changed Original file line number Diff line number Diff line change @@ -41,6 +41,7 @@ macro(targets)
4141 get_rclcpp_information("${rmw_implementation} " "rclcpp${target_suffix} " )
4242
4343 add_library (rclcpp_lifecycle${target_suffix}
44+ SHARED
4445 src/rclcpp_lifecycle/lifecycle_manager.cpp)
4546 target_link_libraries (rclcpp_lifecycle${target_suffix}
4647 rcl_lifecycle)
@@ -54,8 +55,12 @@ macro(targets)
5455 ament_target_dependencies(lifecycle_talker${target_suffix}
5556 "rclcpp${target_suffix} "
5657 "std_msgs" )
57- install (TARGETS lifecycle_talker${target_suffix}
58- DESTINATION bin)
58+
59+ install (TARGETS rclcpp_lifecycle${target_suffix} lifecycle_talker${target_suffix}
60+ ARCHIVE DESTINATION lib
61+ LIBRARY DESTINATION lib
62+ RUNTIME DESTINATION bin
63+ )
5964endmacro ()
6065
6166call_for_each_rmw_implementation(targets GENERATE_DEFAULT)
You can’t perform that action at this time.
0 commit comments