Skip to content

Commit

Permalink
Remove unused python content from planning interface directory (#2665)
Browse files Browse the repository at this point in the history
* Remove unused python content from planning interface directory

* Cleanup test cmake
  • Loading branch information
sjahr authored Jan 30, 2024
1 parent a8cc279 commit 3d16b4a
Show file tree
Hide file tree
Showing 29 changed files with 0 additions and 2,818 deletions.
14 changes: 0 additions & 14 deletions moveit_ros/planning_interface/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -18,19 +18,10 @@ find_package(tf2_geometry_msgs REQUIRED)
find_package(tf2_ros REQUIRED)
find_package(rclcpp REQUIRED)
find_package(rclcpp_action REQUIRED)
find_package(rclpy REQUIRED)

# find_package(PythonInterp REQUIRED)
# find_package(PythonLibs "${PYTHON_VERSION_MAJOR}.${PYTHON_VERSION_MINOR}" REQUIRED)

find_package(Eigen3 REQUIRED)
# find_package(eigenpy REQUIRED)

# Finds Boost Components
include(ConfigExtras.cmake)

set(THIS_PACKAGE_INCLUDE_DIRS
# py_bindings_tools/include
common_planning_interface_objects/include
planning_scene_interface/include
move_group_interface/include
Expand All @@ -40,8 +31,6 @@ set(THIS_PACKAGE_LIBRARIES
moveit_common_planning_interface_objects
moveit_planning_scene_interface
moveit_move_group_interface
# moveit_py_bindings_tools
# moveit_py_bindings_tools_python
)

set(THIS_PACKAGE_INCLUDE_DEPENDS
Expand All @@ -58,16 +47,13 @@ set(THIS_PACKAGE_INCLUDE_DEPENDS
rclcpp
rclcpp_action
Eigen3
Boost
)

include_directories(${THIS_PACKAGE_INCLUDE_DIRS})

# add_subdirectory(py_bindings_tools)
add_subdirectory(common_planning_interface_objects)
add_subdirectory(planning_scene_interface)
add_subdirectory(move_group_interface)
# add_subdirectory(robot_interface)
# add_subdirectory(test)

#############
Expand Down
Loading

0 comments on commit 3d16b4a

Please sign in to comment.