ROS 1 (Deprecated)
WARNING
The PX4 development team recommend that users migrate to ROS 2 (i.e. skip this section)!
ROS 1 is now "discommended" as the last LTS version is approaching end of life. ROS 2 has much deeper integration with PX4, enabling lower-latency communication with access to PX4 internal messaging.
ROS (1) is a general purpose robotics library that can be used with PX4 for drone application development.
This version of ROS uses the MAVROS package to communicate with PX4 over MAVLink (MAVROS bridges ROS topics to MAVLink and PX4 conventions).
Topics
- ROS/MAVROS Installation Guide: Setup a PX4 development environment with ROS 1 and MAVROS.
- ROS/MAVROS Offboard Example (C++): Tutorial showing the main concepts related to writing a C++ MAVROS/ROS node.
- ROS MAVROS Sending Custom Messages
- ROS with Gazebo Classic Simulation
- Gazebo Classic OctoMap Models with ROS
- ROS Installation on RPi
- External Position Estimation (Vision/Motion based)
Further Infomration
- XTDrone - ROS + PX4 simulation environment for computer vision. The XTDrone Manual has everything you need to get started!
- Prometheus Autonomous Drone Project - Prometheus is a ROS 1 based, BSD-3 licensed collection of autonomous drone software packages from AMOVLab, which provides a full set of solutions for the intelligent and autonomous flight of drones, such as mapping, localization, planning, control, and target detection, fully integrated with the Gazebo Classic Simulator.