PX4 ROS 2 Interface Library
Library to interface with PX4 from a companion computer using ROS 2
|
▼Npx4_ros2 | |
▼Ndefault_actions | |
CRtl | Default action to trigger the RTL mode |
CLand | Default action to trigger the Land mode |
CTakeoff | Default action to trigger the Takeoff mode |
CHold | Default action to trigger the Hold (Loiter) mode |
COnResume | Default action to resume missions |
COnFailure | Default action to handle failures |
CChangeSettings | Action to change mission settings (e.g. velocity) |
▼Nevents | |
CLogLevels | |
▼Nmulticopter | |
CWaypointTrajectoryExecutor | Trajectory executor using goto setpoints |
▼Nutil | |
COverloaded | |
CContext | |
CException | |
CRequirementFlags | Requirement flags used by modes |
▼CSetpointBase | |
CConfiguration | |
CHealthAndArmingCheckReporter | |
CHealthAndArmingChecks | |
CManualControlInput | Provides access to manually input control setpoints |
CMessageCompatibilityTopic | |
▼CModeBase | Base class for a mode |
CSettings | |
▼CModeExecutorBase | Base class for a mode executor |
CSettings | |
CNodeWithMode | A ROS2 node which instantiates a control mode and handles its registration with PX4 |
CNodeWithModeExecutor | A ROS2 node which instantiates a mode executor and its owned mode, and handles their registration with PX4 |
CConfigOverrides | |
CPeripheralActuatorControls | Provides control of one or more extra actuators |
CDirectActuatorsSetpointType | Setpoint type for direct actuator control (servos and/or motors) |
CAttitudeSetpointType | Setpoint type for direct attitude control |
CRatesSetpointType | Setpoint type for direct rate control |
CRoverPositionSetpointType | Setpoint type for rover position control |
CRoverSpeedAttitudeSetpointType | Setpoint type for rover speed and attitude control |
CRoverSpeedRateSetpointType | Setpoint type for rover speed and rate control |
CRoverSpeedSteeringSetpointType | Setpoint type for rover speed and steering control |
CRoverThrottleAttitudeSetpointType | Setpoint type for rover throttle and attitude control |
CRoverThrottleRateSetpointType | Setpoint type for rover throttle and rate control |
CRoverThrottleSteeringSetpointType | Setpoint type for rover throttle and steering control |
CTrajectorySetpointType | Setpoint type for trajectory control |
CTrajectorySetpoint | Setpoint structure for trajectory control with fine-grained control over individual components |
CFwLateralLongitudinalSetpointType | Setpoint type for fixedwing control |
CFwLateralLongitudinalSetpoint | |
CFwControlConfiguration | |
CMulticopterGotoSetpointType | Setpoint type for smooth position and heading control |
CMulticopterGotoGlobalSetpointType | Setpoint type for smooth global position and heading control |
CVTOLConfig | |
CVTOL | Provides VTOL transition command |
CActionInterface | Interface class for an action |
CActionArguments | Arguments passed to an action from the mission JSON definition |
CWaypoint | |
CNavigationItem | |
CActionItem | |
CTrajectoryOptions | |
CMissionDefaults | |
CMission | Mission definition |
CMissionFileMonitor | File monitor to load a mission from a JSON file |
▼CMissionExecutor | Mission execution state machine |
CConfiguration | |
CMissionMode | |
CMissionModeExecutor | |
CActionStateKeeper | |
CActionHandler | Handler passed to custom actions to run modes, actions and trajectories |
▼CTrajectoryExecutorInterface | Interface for a trajectory executor |
CTrajectoryConfig | |
CGlobalPositionMeasurement | Represents a global position measurement to be passed to GlobalPositionMeasurementInterface::update |
CGlobalPositionMeasurementInterface | Base class for a global position measurement provider |
CLocalPositionMeasurement | Represents a local position measurement to be passed to LocalPositionMeasurementInterface::update |
CLocalPositionMeasurementInterface | Base class for a local position measurement provider |
CNavigationInterfaceInvalidArgument | Thrown to report invalid arguments to measurement interface |
CPositionMeasurementInterfaceBase | Base class for position measurement interface |
COdometryAirspeed | Provides access to the vehicle's airspeed estimates |
COdometryAngularVelocity | Provides access to the vehicle's angular velocity estimate |
COdometryAttitude | Provides access to the vehicle's attitude estimate |
COdometryGlobalPosition | Provides access to the vehicle's global position estimate |
COdometryLocalPosition | Provides access to the vehicle's local position estimate |
CMapProjection | Provides methods to convert between the geographical coordinate system ("global") and the local azimuthal equidistant plane ("local") |
CHasMessageVersion | Trait to check if a message type T has a MESSAGE_VERSION constant |
CHasMessageVersion< T, std::void_t< decltype(T::MESSAGE_VERSION)> > | Specialization for types that have a MESSAGE_VERSION constant |
CSubscription | Provides a subscription to arbitrary ROS topics |
CBattery | Provides access to the vehicle's battery status |
CHomePosition | Provides access to the vehicle's home position |
CLandDetected | Provides access to the vehicle's status |
CVehicleStatus | Provides access to the vehicle's status |
CVtolStatus | Provides access to the vtol vehicle's status |