PX4 ROS 2 Interface Library
Library to interface with PX4 from a companion computer using ROS 2
|
Cpx4_ros2::ConfigOverrides | |
Cpx4_ros2::SetpointBase::Configuration | |
▼Cpx4_ros2::Context | |
Cpx4_ros2::ModeBase | Base class for a mode |
▼Cpx4_ros2::PositionMeasurementInterfaceBase | Base class for position measurement interface |
Cpx4_ros2::GlobalPositionMeasurementInterface | Base class for a global position measurement provider |
Cpx4_ros2::LocalPositionMeasurementInterface | Base class for a local position measurement provider |
▼Cstd::enable_shared_from_this | |
▼Cpx4_ros2::SetpointBase | |
Cpx4_ros2::AttitudeSetpointType | Setpoint type for direct attitude control |
Cpx4_ros2::DirectActuatorsSetpointType | Setpoint type for direct actuator control (servos and/or motors) |
Cpx4_ros2::GotoSetpointType | Setpoint type for smooth position and heading control |
Cpx4_ros2::RatesSetpointType | Setpoint type for direct rate control |
Cpx4_ros2::TrajectorySetpointType | Setpoint type for trajectory control |
▼Cstd::false_type | |
Cpx4_ros2::HasMessageVersion< T, typename > | Trait to check if a message type T has a MESSAGE_VERSION constant |
Cpx4_ros2::GlobalPositionMeasurement | Represents a global position measurement to be passed to GlobalPositionMeasurementInterface::update |
Cpx4_ros2::GotoGlobalSetpointType | Setpoint type for smooth global position and heading control |
Cpx4_ros2::HealthAndArmingCheckReporter | |
Cpx4_ros2::HealthAndArmingChecks | |
▼Cstd::invalid_argument | |
Cpx4_ros2::NavigationInterfaceInvalidArgument | Thrown to report invalid arguments to measurement interface |
Cpx4_ros2::LocalPositionMeasurement | Represents a local position measurement to be passed to LocalPositionMeasurementInterface::update |
Cpx4_ros2::events::LogLevels | |
Cpx4_ros2::ManualControlInput | Provides access to manually input control setpoints |
Cpx4_ros2::MapProjection | Provides methods to convert between the geographical coordinate system ("global") and the local azimuthal equidistant plane ("local") |
Cpx4_ros2::MessageCompatibilityTopic | |
Cpx4_ros2::ModeExecutorBase | Base class for a mode executor |
▼Crclcpp::Node | |
Cpx4_ros2::NodeWithMode< ModeT > | A ROS2 node which instantiates a control mode and handles its registration with PX4 |
Cpx4_ros2::NodeWithModeExecutor< ModeExecutorT, OwnedModeT, OtherModesT > | A ROS2 node which instantiates a mode executor and its owned mode, and handles their registration with PX4 |
Cpx4_ros2::PeripheralActuatorControls | Provides control of one or more extra actuators |
Cpx4_ros2::RequirementFlags | Requirement flags used by modes |
Cpx4_ros2::ModeBase::Settings | |
Cpx4_ros2::ModeExecutorBase::Settings | |
Cpx4_ros2::Subscription< RosMessageType > | Provides a subscription to arbitrary ROS topics |
▼Cpx4_ros2::Subscription< px4_msgs::msg::BatteryStatus > | |
Cpx4_ros2::Battery | Provides access to the vehicle's battery status |
▼Cpx4_ros2::Subscription< px4_msgs::msg::HomePosition > | |
Cpx4_ros2::HomePosition | Provides access to the vehicle's home position |
▼Cpx4_ros2::Subscription< px4_msgs::msg::VehicleAngularVelocity > | |
Cpx4_ros2::OdometryAngularVelocity | Provides access to the vehicle's angular velocity estimate |
▼Cpx4_ros2::Subscription< px4_msgs::msg::VehicleAttitude > | |
Cpx4_ros2::OdometryAttitude | Provides access to the vehicle's attitude estimate |
▼Cpx4_ros2::Subscription< px4_msgs::msg::VehicleGlobalPosition > | |
Cpx4_ros2::OdometryGlobalPosition | Provides access to the vehicle's global position estimate |
▼Cpx4_ros2::Subscription< px4_msgs::msg::VehicleLandDetected > | |
Cpx4_ros2::LandDetected | Provides access to the vehicle's status |
▼Cpx4_ros2::Subscription< px4_msgs::msg::VehicleLocalPosition > | |
Cpx4_ros2::OdometryLocalPosition | Provides access to the vehicle's local position estimate |
▼Cpx4_ros2::Subscription< px4_msgs::msg::VehicleStatus > | |
Cpx4_ros2::VehicleStatus | Provides access to the vehicle's status |
▼Cpx4_ros2::Subscription< px4_msgs::msg::VtolVehicleStatus > | |
Cpx4_ros2::VtolStatus | Provides access to the vtol vehicle's status |
Cpx4_ros2::TrajectorySetpoint | Setpoint structure for trajectory control with fine-grained control over individual components |
▼Cstd::true_type | |
Cpx4_ros2::HasMessageVersion< T, std::void_t< decltype(T::MESSAGE_VERSION)> > | Specialization for types that have a MESSAGE_VERSION constant |