ros-mobile-robots / diffbot

DiffBot is an autonomous 2wd differential drive robot using ROS Noetic on a Raspberry Pi 4 B. With its SLAMTEC Lidar and the ROS Control hardware interface it's capable of navigating in an environment using the ROS Navigation stack and making use of SLAM algorithms to create maps of unknown environments.
https://ros-mobile-robots.com
BSD 3-Clause "New" or "Revised" License
275 stars 82 forks source link

Make use of rosdep for system dependencies #28

Open fjp opened 3 years ago

fjp commented 3 years ago

Test installation of the packages from this repository from scratch using rosdep (see also the documentation).

For example to see the required dependencies for a package use:

rosdep check diffbot_control
All system dependencies have been satisfied

or the verbose version in case all system dependencies are installed:

rosdep -v check diffbot_control
...
resolving for resources [diffbot_control]
resolve_all: resource [diffbot_control] requires rosdep keys [controller_manager, diff_drive_controller, hardware_interface, roscpp, rosparam_shortcuts, sensor_msgs, transmission_interface, catkin, controller_manager, joint_state_controller, robot_state_publisher, diff_drive_controller, hardware_interface, roscpp, rosparam_shortcuts, sensor_msgs, transmission_interface]
loading view [*default*] with rospkg loader
resolution: apt [ros-noetic-controller-manager, ros-noetic-diff-drive-controller, ros-noetic-hardware-interface, ros-noetic-roscpp, ros-noetic-rosparam-shortcuts, ros-noetic-sensor-msgs, ros-noetic-transmission-interface, ros-noetic-catkin, ros-noetic-joint-state-controller, ros-noetic-robot-state-publisher]
uninstalled: []
All system dependencies have been satisfied

and install the missing packages using

rosdep install AMAZING_PACKAGE