Skip to content

Commit

Permalink
Removing dep on panda_moveit_config and franka_description (instead, …
Browse files Browse the repository at this point in the history
…continue to depend on moveit_resources_panda pkgs)
  • Loading branch information
130s committed Jun 11, 2023
1 parent d6a859a commit 28de005
Show file tree
Hide file tree
Showing 3 changed files with 0 additions and 11 deletions.
6 changes: 0 additions & 6 deletions .github/upstream.repos
Original file line number Diff line number Diff line change
@@ -1,7 +1,4 @@
repositories:
franka_ros2:
type: git
url: https://github.com/frankaemika/franka_ros2.git
moveit_task_constructor:
type: git
url: https://github.com/ros-planning/moveit_task_constructor.git
Expand All @@ -10,9 +7,6 @@ repositories:
type: git
url: https://github.com/ros-planning/moveit_visual_tools
version: ros2
panda_moveit_config:
type: git
url: https://github.com/ros-planning/panda_moveit_config
rosparam_shortcuts:
type: git
url: https://github.com/PickNikRobotics/rosparam_shortcuts
Expand Down
3 changes: 0 additions & 3 deletions moveit2_tutorials.repos
Original file line number Diff line number Diff line change
Expand Up @@ -27,6 +27,3 @@ repositories:
type: git
url: https://github.com/ros-planning/moveit_msgs
version: ros2
panda_moveit_config:
type: git
url: https://github.com/ros-planning/panda_moveit_config
2 changes: 0 additions & 2 deletions package.xml
Original file line number Diff line number Diff line change
Expand Up @@ -44,7 +44,6 @@
<build_depend>moveit_common</build_depend>
<build_depend>moveit_ros_planning</build_depend>

<exec_depend>franka_description</exec_depend>
<!-- <exec_depend>moveit_commander</exec_depend> -->
<exec_depend>controller_manager</exec_depend>
<exec_depend>gripper_controllers</exec_depend>
Expand All @@ -57,7 +56,6 @@
<exec_depend>moveit_resources_panda_moveit_config</exec_depend>
<exec_depend>moveit_configs_utils</exec_depend>
<exec_depend>moveit_py</exec_depend>
<exec_depend>panda_moveit_config</exec_depend>
<exec_depend>robot_state_publisher</exec_depend>
<exec_depend>ros2_control</exec_depend>
<exec_depend>rviz2</exec_depend>
Expand Down

0 comments on commit 28de005

Please sign in to comment.