PX4 ROS 2 Interface Library
Library to interface with PX4 from a companion computer using ROS 2
Class List
Here are the classes, structs, unions and interfaces with brief descriptions:
[detail level 123]
 Npx4_ros2
 Ndefault_actions
 CRtlDefault action to trigger the RTL mode
 CLandDefault action to trigger the Land mode
 CTakeoffDefault action to trigger the Takeoff mode
 CHoldDefault action to trigger the Hold (Loiter) mode
 COnResumeDefault action to resume missions
 COnFailureDefault action to handle failures
 CChangeSettingsAction to change mission settings (e.g. velocity)
 Nevents
 CLogLevels
 Nmulticopter
 CWaypointTrajectoryExecutorTrajectory executor using goto setpoints
 Nutil
 COverloaded
 CContext
 CException
 CRequirementFlagsRequirement flags used by modes
 CSetpointBase
 CConfiguration
 CHealthAndArmingCheckReporter
 CHealthAndArmingChecks
 CManualControlInputProvides access to manually input control setpoints
 CMessageCompatibilityTopic
 CModeBaseBase class for a mode
 CSettings
 CModeExecutorBaseBase class for a mode executor
 CSettings
 CNodeWithModeA ROS2 node which instantiates a control mode and handles its registration with PX4
 CNodeWithModeExecutorA ROS2 node which instantiates a mode executor and its owned mode, and handles their registration with PX4
 CConfigOverrides
 CPeripheralActuatorControlsProvides control of one or more extra actuators
 CDirectActuatorsSetpointTypeSetpoint type for direct actuator control (servos and/or motors)
 CAttitudeSetpointTypeSetpoint type for direct attitude control
 CRatesSetpointTypeSetpoint type for direct rate control
 CRoverPositionSetpointTypeSetpoint type for rover position control
 CRoverSpeedAttitudeSetpointTypeSetpoint type for rover speed and attitude control
 CRoverSpeedRateSetpointTypeSetpoint type for rover speed and rate control
 CRoverSpeedSteeringSetpointTypeSetpoint type for rover speed and steering control
 CRoverThrottleAttitudeSetpointTypeSetpoint type for rover throttle and attitude control
 CRoverThrottleRateSetpointTypeSetpoint type for rover throttle and rate control
 CRoverThrottleSteeringSetpointTypeSetpoint type for rover throttle and steering control
 CTrajectorySetpointTypeSetpoint type for trajectory control
 CTrajectorySetpointSetpoint structure for trajectory control with fine-grained control over individual components
 CFwLateralLongitudinalSetpointTypeSetpoint type for fixedwing control
 CFwLateralLongitudinalSetpoint
 CFwControlConfiguration
 CMulticopterGotoSetpointTypeSetpoint type for smooth position and heading control
 CMulticopterGotoGlobalSetpointTypeSetpoint type for smooth global position and heading control
 CVTOLConfig
 CVTOLProvides VTOL transition command
 CActionInterfaceInterface class for an action
 CActionArgumentsArguments passed to an action from the mission JSON definition
 CWaypoint
 CNavigationItem
 CActionItem
 CTrajectoryOptions
 CMissionDefaults
 CMissionMission definition
 CMissionFileMonitorFile monitor to load a mission from a JSON file
 CMissionExecutorMission execution state machine
 CConfiguration
 CMissionMode
 CMissionModeExecutor
 CActionStateKeeper
 CActionHandlerHandler passed to custom actions to run modes, actions and trajectories
 CTrajectoryExecutorInterfaceInterface for a trajectory executor
 CTrajectoryConfig
 CGlobalPositionMeasurementRepresents a global position measurement to be passed to GlobalPositionMeasurementInterface::update
 CGlobalPositionMeasurementInterfaceBase class for a global position measurement provider
 CLocalPositionMeasurementRepresents a local position measurement to be passed to LocalPositionMeasurementInterface::update
 CLocalPositionMeasurementInterfaceBase class for a local position measurement provider
 CNavigationInterfaceInvalidArgumentThrown to report invalid arguments to measurement interface
 CPositionMeasurementInterfaceBaseBase class for position measurement interface
 COdometryAirspeedProvides access to the vehicle's airspeed estimates
 COdometryAngularVelocityProvides access to the vehicle's angular velocity estimate
 COdometryAttitudeProvides access to the vehicle's attitude estimate
 COdometryGlobalPositionProvides access to the vehicle's global position estimate
 COdometryLocalPositionProvides access to the vehicle's local position estimate
 CMapProjectionProvides methods to convert between the geographical coordinate system ("global") and the local azimuthal equidistant plane ("local")
 CHasMessageVersionTrait 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
 CSubscriptionProvides a subscription to arbitrary ROS topics
 CBatteryProvides access to the vehicle's battery status
 CHomePositionProvides access to the vehicle's home position
 CLandDetectedProvides access to the vehicle's status
 CVehicleStatusProvides access to the vehicle's status
 CVtolStatusProvides access to the vtol vehicle's status