diff --git a/.github/workflows/ci.yaml b/.github/workflows/ci.yaml
index ccb076d896..633984ed97 100644
--- a/.github/workflows/ci.yaml
+++ b/.github/workflows/ci.yaml
@@ -39,7 +39,7 @@ jobs:
         moveit2.repos
         $(f="moveit2_$(sed 's/-.*$//' <<< "${{ matrix.env.IMAGE }}").repos"; test -r $f && echo $f)
       # Pull any updates to the upstream workspace (after restoring it from cache)
-      AFTER_SETUP_UPSTREAM_WORKSPACE: apt remove -y ros-$ROS_DISTRO-geometric-shapes; vcs pull $BASEDIR/upstream_ws/src
+      AFTER_SETUP_UPSTREAM_WORKSPACE: vcs pull $BASEDIR/upstream_ws/src
       AFTER_SETUP_DOWNSTREAM_WORKSPACE: vcs pull $BASEDIR/downstream_ws/src
       # Clear the ccache stats before and log the stats after the build
       AFTER_SETUP_CCACHE: ccache --zero-stats --max-size=10.0G
diff --git a/moveit2.repos b/moveit2.repos
index 6ce029c513..7426af03df 100644
--- a/moveit2.repos
+++ b/moveit2.repos
@@ -1,9 +1,5 @@
 repositories:
   # Keep moveit_* repos here because they are released with moveit
-  geometric_shapes:
-    type: git
-    url: https://github.com/moveit/geometric_shapes.git
-    version: ros2
   moveit_msgs:
     type: git
     url: https://github.com/moveit/moveit_msgs.git
@@ -12,7 +8,3 @@ repositories:
     type: git
     url: https://github.com/moveit/moveit_resources.git
     version: ros2
-  srdfdom:
-    type: git
-    url: https://github.com/moveit/srdfdom.git
-    version: ros2