Classes | |
class | ActuatorControlPlugin |
ActuatorControl plugin. More... | |
class | AltitudePlugin |
Altitude plugin. More... | |
class | BatteryStatusDiag |
Battery diagnostic updater. More... | |
class | CommandPlugin |
Command plugin. More... | |
class | CommandTransaction |
class | DummyPlugin |
Dummy plugin. More... | |
class | FTPPlugin |
FTP plugin. More... | |
class | FTPRequest |
FTP Request message abstraction class. More... | |
class | GlobalPositionPlugin |
Global position plugin. More... | |
class | HeartbeatStatus |
class | HilPlugin |
Hil plugin. More... | |
class | HomePositionPlugin |
home position plugin. More... | |
class | HwStatus |
Hardware status (APM-only) More... | |
class | IMUPlugin |
IMU and attitude data publication plugin. More... | |
class | LocalPositionPlugin |
Local position plugin. Publish local position to TF, PositionStamped, TwistStamped and Odometry. More... | |
class | ManualControlPlugin |
Manual Control plugin. More... | |
class | MemInfo |
Memory usage diag (APM-only) More... | |
class | Parameter |
Parameter storage. More... | |
class | ParamPlugin |
Parameter manipulation plugin. More... | |
class | ParamSetOpt |
Parameter set transaction data. More... | |
class | RCIOPlugin |
RC IO plugin. More... | |
class | SafetyAreaPlugin |
Safety allopwed area plugin. More... | |
class | SetpointAccelerationPlugin |
Setpoint acceleration/force plugin. More... | |
class | SetpointAttitudePlugin |
Setpoint attitude plugin. More... | |
class | SetpointPositionPlugin |
Setpoint position plugin. More... | |
class | SetpointRawPlugin |
Setpoint RAW plugin. More... | |
class | SetpointVelocityPlugin |
Setpoint velocity plugin. More... | |
class | SystemStatusDiag |
System status diagnostic updater. More... | |
class | SystemStatusPlugin |
System status plugin. More... | |
class | SystemTimePlugin |
System time plugin. More... | |
class | TDRRadioPlugin |
3DR Radio plugin. More... | |
class | TimeSyncStatus |
class | VfrHudPlugin |
VFR HUD plugin. More... | |
class | WaypointItem |
class | WaypointPlugin |
Mission manupulation plugin. More... | |
class | WindEstimationPlugin |
Wind estimation plugin. More... | |
Typedefs | |
using | lock_guard = std::lock_guard< std::mutex > |
using | MRES = mavlink::common::MAV_MISSION_RESULT |
using | SyncPoseThrust = message_filters::Synchronizer< SyncPoseThrustPolicy > |
using | SyncPoseThrustPolicy = message_filters::sync_policies::ApproximateTime< geometry_msgs::PoseStamped, mavros_msgs::Thrust > |
using | SyncTwistThrust = message_filters::Synchronizer< SyncTwistThrustPolicy > |
using | SyncTwistThrustPolicy = message_filters::sync_policies::ApproximateTime< geometry_msgs::TwistStamped, mavros_msgs::Thrust > |
using | unique_lock = std::unique_lock< std::mutex > |
Variables | |
static constexpr double | GAUSS_TO_TESLA = 1.0e-4 |
Gauss to Tesla coeff. More... | |
static constexpr double | MILLIBAR_TO_PASCAL = 1.0e2 |
millBar to Pascal coeff More... | |
static constexpr double | MILLIG_TO_MS2 = 9.80665 / 1000.0 |
millG to m/s**2 coeff More... | |
static constexpr double | MILLIMS2_TO_MS2 = 1.0e-3 |
millm/s**2 to m/s**2 coeff More... | |
static constexpr double | MILLIRS_TO_RADSEC = 1.0e-3 |
millRad/Sec to Rad/Sec coeff More... | |
static constexpr double | MILLIT_TO_TESLA = 1000.0 |
millTesla to Tesla coeff More... | |
static constexpr double | PASCAL_TO_MILLIBAR = 1.0e-2 |
Pascal to millBar coeff. More... | |
static constexpr double | RAD_TO_DEG = 180.0 / M_PI |
Radians to degrees. More... | |
static constexpr double | TESLA_TO_GAUSS = 1.0e4 |
Tesla to Gauss coeff. More... | |