File tree Expand file tree Collapse file tree 2 files changed +4
-4
lines changed Expand file tree Collapse file tree 2 files changed +4
-4
lines changed Original file line number Diff line number Diff line change @@ -34,8 +34,7 @@ install(DIRECTORY include/ DESTINATION include
3434
3535pluginlib_export_plugin_description_file(${PROJECT_NAME} motion_planning_stages_plugin_description.xml)
3636
37- ament_export_include_directories(include )
38- ament_export_libraries(${PROJECT_NAME} ${PROJECT_NAME} _stages)
37+ ament_export_targets(${PROJECT_NAME} Targets HAS_LIBRARY_TARGET)
3938ament_export_dependencies(Boost)
4039ament_export_dependencies(geometry_msgs)
4140ament_export_dependencies(moveit_core)
Original file line number Diff line number Diff line change @@ -47,12 +47,13 @@ ament_target_dependencies(${PROJECT_NAME}
4747)
4848target_include_directories (${PROJECT_NAME}
4949 PUBLIC $<BUILD_INTERFACE:${PROJECT_SOURCE_DIR} /include >
50- PUBLIC $<BUILD_INTERFACE:${CMAKE_CURRENT_SOURCE_DIR} >
50+ $<BUILD_INTERFACE:${CMAKE_CURRENT_SOURCE_DIR} >
51+ $<INSTALL_INTERFACE:include >
5152)
5253
5354add_subdirectory (stages)
5455
5556install (TARGETS ${PROJECT_NAME}
56- EXPORT ${PROJECT_NAME}
57+ EXPORT ${PROJECT_NAME} Targets
5758 ARCHIVE DESTINATION lib
5859 LIBRARY DESTINATION lib)
You can’t perform that action at this time.
0 commit comments