ROS 1 with MAVROS
Last updated
Last updated
:::tip The PX4 development team recommend that users migrate to (i.e. skip this section)! :::
(Robot Operating System) is a general-purpose robotics library that can be used to create powerful drone applications for the PX4 Autopilot.
This section contains topics related to using the "original version of ROS" and the package to communicate with PX4 over (MAVROS bridges ROS topics to MAVLink and PX4 conventions).
The main topics covered are:
: Setup a PX4 development environment with ROS 1 and MAVROS.
: Tutorial showing the main concepts related to writing a C++ MAVROS/ROS node.
.
- ROS + PX4 simulation environment for computer vision. The has everything you need to get started!
- Prometheus is a ROS 1 based, BSD-3 licensed collection of autonomous drone software packages from , 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 Simulator.