Skip to content

Commit

Permalink
Update moveit2.repos
Browse files Browse the repository at this point in the history
  • Loading branch information
henningkayser committed Aug 11, 2020
1 parent 4355924 commit dde7bbb
Showing 1 changed file with 11 additions and 33 deletions.
44 changes: 11 additions & 33 deletions moveit2.repos
Original file line number Diff line number Diff line change
@@ -1,53 +1,31 @@
repositories:
moveit2:
type: git
url: https://github.com/ros-planning/moveit2
version: master
url: https://github.com/henningkayser/moveit2
version: foxy
moveit_msgs:
type: git
url: https://github.com/ros-planning/moveit_msgs
version: ros2
joint_state_publisher:
type: git
url: https://github.com/ros/joint_state_publisher
version: ros2
random_numbers:
type: git
url: https://github.com/ros-planning/random_numbers
version: ros2
urdf_parser_py:
type: git
url: https://github.com/ros/urdf_parser_py
version: ros2
moveit_resources:
type: git
url: https://github.com/ros-planning/moveit_resources
version: ros2
geometric_shapes:
type: git
url: https://github.com/ros-planning/geometric_shapes
version: dashing-devel
srdfdom:
type: git
url: https://github.com/ros-planning/srdfdom
version: ros2
octomap_msgs:
srdfdom:
type: git
url: https://github.com/OctoMap/octomap_msgs
url: https://github.com/PickNikRobotics/srdfdom
version: ros2

# Dependencies with pending PRs
object_recognition_msgs:
# TODO(#242): Remove below once console_bridge conflict is resolved
urdfdom:
type: git
# TODO(henningkayser): use upstream version once #8 is merged
# url: https://github.com/wg-perception/object_recognition_msgs
# version: ros2
url: https://github.com/PickNikRobotics/object_recognition_msgs
version: master

# Temporarily install OMPL from melodic
# TODO(henningkayser): remove once OMPL is released for ROS2
ompl:
url: https://github.com/ros2/urdfdom
version: foxy
urdfdom_headers:
type: git
url: https://github.com/ros-gbp/ompl-release.git
version: release/melodic/ompl/1.4.2-5
url: https://github.com/ros/urdfdom_headers
version: foxy

0 comments on commit dde7bbb

Please sign in to comment.