Skip to content

Commit

Permalink
Add PUBLIC/PRIVATE keywords
Browse files Browse the repository at this point in the history
Signed-off-by: Shane Loretz <sloretz@intrinsic.ai>
(cherry picked from commit 68a6ee2)
  • Loading branch information
sloretz authored and mergify[bot] committed Aug 14, 2023
1 parent 5de1908 commit 6aca1c3
Showing 1 changed file with 4 additions and 4 deletions.
8 changes: 4 additions & 4 deletions moveit_kinematics/cached_ik_kinematics_plugin/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -4,7 +4,7 @@ find_package(ur_kinematics QUIET)

add_library(moveit_cached_ik_kinematics_base SHARED src/ik_cache.cpp)
set_target_properties(moveit_cached_ik_kinematics_base PROPERTIES VERSION "${${PROJECT_NAME}_VERSION}")
ament_target_dependencies(moveit_cached_ik_kinematics_base
ament_target_dependencies(moveit_cached_ik_kinematics_base PUBLIC
rclcpp
moveit_core
moveit_msgs
Expand All @@ -19,19 +19,19 @@ generate_parameter_library(
include/moveit/cached_ik_kinematics_plugin/cached_ik_kinematics_parameters.yaml # path to input yaml file
)

target_link_libraries(moveit_cached_ik_kinematics_base
target_link_libraries(moveit_cached_ik_kinematics_base PUBLIC
cached_ik_kinematics_parameters
moveit_kdl_kinematics_plugin)

add_library(moveit_cached_ik_kinematics_plugin SHARED src/cached_ik_kinematics_plugin.cpp)
set_target_properties(moveit_cached_ik_kinematics_plugin PROPERTIES VERSION "${${PROJECT_NAME}_VERSION}")
ament_target_dependencies(moveit_cached_ik_kinematics_plugin
ament_target_dependencies(moveit_cached_ik_kinematics_plugin PUBLIC
rclcpp
moveit_core
moveit_msgs
rsl
)
target_link_libraries(moveit_cached_ik_kinematics_plugin
target_link_libraries(moveit_cached_ik_kinematics_plugin PRIVATE
cached_ik_kinematics_parameters
moveit_kdl_kinematics_plugin
moveit_srv_kinematics_plugin
Expand Down

0 comments on commit 6aca1c3

Please sign in to comment.