Skip to content

Commit 77c7701

Browse files
committed
Misc progresss
Signed-off-by: Shane Loretz <shane.loretz@gmail.com>
1 parent 4f60214 commit 77c7701

File tree

1 file changed

+47
-0
lines changed

1 file changed

+47
-0
lines changed

source/How-To-Guides/Migrating-from-ROS1/Migrating-Dependencies.rst

Lines changed: 47 additions & 0 deletions
Original file line numberDiff line numberDiff line change
@@ -67,6 +67,7 @@ TODO if the package to be installed starts with `ros-distro`, then it's a ROS pa
6767
.. code-block:: bash
6868
6969
$ rosdep keys --from-paths /tmp/geometry2/tf2_kdl | xargs rosdep resolve --os=ubuntu:focal --rosdistro=noetic
70+
WARNING: ROS_PYTHON_VERSION is unset. Defaulting to 3
7071
#ROSDEP[eigen]
7172
#apt
7273
libeigen3-dev
@@ -93,6 +94,48 @@ TODO if the package to be installed starts with `ros-distro`, then it's a ROS pa
9394
ros-noetic-ros-environment
9495
9596
97+
.. tabs::
98+
99+
.. group-tab:: Linux
100+
101+
.. code-block:: bash
102+
103+
cd /tmp
104+
git clone https://github.com/ros/geometry2.git
105+
rosdep keys --from-paths /tmp/geometry2/tf2_kdl | xargs rosdep resolve --os=ubuntu:noble --rosdistro=rolling
106+
107+
108+
.. tabs::
109+
110+
.. group-tab:: Linux
111+
112+
.. code-block:: bash
113+
114+
$ rosdep keys --from-paths /tmp/geometry2/tf2_kdl | xargs rosdep resolve --os=ubuntu:noble --rosdistro=rolling
115+
WARNING: ROS_PYTHON_VERSION is unset. Defaulting to 3
116+
#ROSDEP[tf2]
117+
#apt
118+
ros-rolling-tf2
119+
#ROSDEP[catkin]
120+
#ROSDEP[rostest]
121+
#ROSDEP[liborocos-kdl-dev]
122+
#apt
123+
liborocos-kdl-dev
124+
#ROSDEP[ros_environment]
125+
#apt
126+
ros-rolling-ros-environment
127+
#ROSDEP[cmake_modules]
128+
#ROSDEP[eigen]
129+
#apt
130+
libeigen3-dev
131+
#ROSDEP[tf2_ros]
132+
#apt
133+
ros-rolling-tf2-ros
134+
ERROR: no rosdep rule for 'catkin'
135+
ERROR: no rosdep rule for 'rostest'
136+
ERROR: no rosdep rule for 'cmake_modules'
137+
138+
96139
Check if a rosdep key is available
97140
----------------------------------
98141

@@ -120,12 +163,16 @@ TODO move_base -> nav2, ... what else?
120163
- ROS 2
121164
* - catkin
122165
- ament_cmake_ros
166+
* - cmake_modules
167+
- tinyxml_vendor, tinyxml2_vendor, eigen3_cmake_module
123168
* - roscpp
124169
- rclcpp
125170
* - roslaunch
126171
- launch_ros
127172
* - rospy
128173
- rclpy
174+
* - rostest
175+
- launch_testing_ros
129176

130177
Conclusion
131178
----------

0 commit comments

Comments
 (0)