# ROS 1 with MAVROS

TIP

The PX4 development team recommend that users migrate to ROS 2 (i.e. skip this section)!

ROS (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 MAVROS package to communicate with PX4 over MAVLink (MAVROS bridges ROS topics to MAVLink and PX4 conventions).

The main topics covered are:

# Other Resources