Skip to content

Commit

Permalink
Eigen/CMake cleanup
Browse files Browse the repository at this point in the history
  • Loading branch information
AndyZe committed Oct 24, 2023
1 parent d8e47de commit 7dd5c08
Show file tree
Hide file tree
Showing 3 changed files with 8 additions and 9 deletions.
2 changes: 1 addition & 1 deletion moveit_core/online_signal_smoothing/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -15,7 +15,7 @@ set_target_properties(moveit_smoothing_base PROPERTIES VERSION
)
ament_target_dependencies(moveit_smoothing_base
rclcpp
tf2_eigen
Eigen3
)

# Plugin implementations
Expand Down
7 changes: 2 additions & 5 deletions moveit_ros/moveit_servo/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -18,21 +18,18 @@ set(THIS_PACKAGE_INCLUDE_DEPENDS
sensor_msgs
std_msgs
std_srvs
tf2_eigen
trajectory_msgs
)

find_package(ament_cmake REQUIRED)
find_package(eigen3_cmake_module REQUIRED)
find_package(Eigen3 REQUIRED)
find_package(generate_parameter_library REQUIRED)
foreach(Dependency IN ITEMS ${THIS_PACKAGE_INCLUDE_DEPENDS})
find_package(${Dependency} REQUIRED)
endforeach()

include_directories(
include
SYSTEM
${EIGEN3_INCLUDE_DIRS}
)

###################
Expand All @@ -54,7 +51,7 @@ add_library(moveit_servo_lib_cpp SHARED

)
set_target_properties(moveit_servo_lib_cpp PROPERTIES VERSION "${moveit_servo_VERSION}")
target_link_libraries(moveit_servo_lib_cpp moveit_servo_lib_parameters ${Eigen_LIBRARIES})
target_link_libraries(moveit_servo_lib_cpp moveit_servo_lib_parameters)
ament_target_dependencies(moveit_servo_lib_cpp ${THIS_PACKAGE_INCLUDE_DEPENDS})

add_library(moveit_servo_lib_ros SHARED src/servo_node.cpp)
Expand Down
8 changes: 5 additions & 3 deletions moveit_ros/moveit_servo/package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -26,24 +26,26 @@
<depend>control_msgs</depend>
<depend>generate_parameter_library</depend>
<depend>geometry_msgs</depend>
<depend>moveit_msgs</depend>
<depend>moveit_core</depend>
<depend>moveit_msgs</depend>
<depend>moveit_ros_planning_interface</depend>
<depend>pluginlib</depend>
<depend>realtime_tools</depend>
<depend>sensor_msgs</depend>
<depend>std_msgs</depend>
<depend>std_srvs</depend>
<depend>tf2_eigen</depend>
<depend>trajectory_msgs</depend>

<exec_depend>controller_manager</exec_depend>
<exec_depend>gripper_controllers</exec_depend>
<exec_depend>joint_state_broadcaster</exec_depend>
<exec_depend>joint_trajectory_controller</exec_depend>
<exec_depend>joy</exec_depend>
<exec_depend>robot_state_publisher</exec_depend>
<exec_depend>moveit_configs_utils</exec_depend>
<exec_depend>launch_param_builder</exec_depend>
<exec_depend>moveit_configs_utils</exec_depend>
<exec_depend>robot_state_publisher</exec_depend>
<exec_depend>tf2_ros</exec_depend>

<test_depend>ament_cmake_gtest</test_depend>
<test_depend>ament_lint_auto</test_depend>
Expand Down

0 comments on commit 7dd5c08

Please sign in to comment.