Skip to content

Commit

Permalink
Update workspace dependencies (#975)
Browse files Browse the repository at this point in the history
Signed-off-by: Tyler Weaver <tyler@picknik.ai>
  • Loading branch information
tylerjw authored Feb 7, 2022
1 parent dd72865 commit 811dd46
Show file tree
Hide file tree
Showing 3 changed files with 2 additions and 34 deletions.
2 changes: 1 addition & 1 deletion .docker/ci/Dockerfile
Original file line number Diff line number Diff line change
Expand Up @@ -29,7 +29,7 @@ RUN \
ccache && \
#
# Fetch all dependencies from moveit2.repos
vcs import src < src/moveit2/moveit2.repos && \
if [ -r src/moveit2/moveit2.repos ] ; vcs import src < src/moveit2/moveit2.repos && \
if [ -r src/moveit2/moveit2_${ROS_DISTRO}.repos ] ; then vcs import src < src/moveit2/moveit2_${ROS_DISTRO}.repos ; fi && \
#
# Download all dependencies of MoveIt
Expand Down
2 changes: 1 addition & 1 deletion .docker/source/Dockerfile
Original file line number Diff line number Diff line change
Expand Up @@ -22,7 +22,7 @@ RUN --mount=type=cache,target=/root/.ccache/ \
# Enable ccache
PATH=/usr/lib/ccache:$PATH && \
# Fetch required upstream sources for building
vcs import src < src/moveit2/moveit2.repos && \
if [ -r src/moveit2/moveit2.repos ] ; vcs import src < src/moveit2/moveit2.repos && \
if [ -r src/moveit2/moveit2_${ROS_DISTRO}.repos ] ; then vcs import src < src/moveit2/moveit2_${ROS_DISTRO}.repos ; fi && \
#
. /opt/ros/${ROS_DISTRO}/setup.sh &&\
Expand Down
32 changes: 0 additions & 32 deletions moveit2.repos
Original file line number Diff line number Diff line change
@@ -1,33 +1 @@
repositories:
moveit_msgs:
type: git
url: https://github.com/ros-planning/moveit_msgs
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: foxy
srdfdom:
type: git
url: https://github.com/ros-planning/srdfdom
version: ros2
ros2_control:
type: git
url: https://github.com/ros-controls/ros2_control
version: foxy
ros2_controllers:
type: git
url: https://github.com/ros-controls/ros2_controllers
version: foxy
warehouse_ros:
type: git
url: https://github.com/ros-planning/warehouse_ros
version: foxy
warehouse_ros_mongo:
type: git
url: https://github.com/ros-planning/warehouse_ros_mongo
version: ros2

0 comments on commit 811dd46

Please sign in to comment.