MAVROS Plugin context. More...
#include <array>
#include <mutex>
#include <atomic>
#include <type_traits>
#include <eigen_conversions/eigen_msg.h>
#include <tf2_ros/transform_listener.h>
#include <tf2_ros/transform_broadcaster.h>
#include <tf2_ros/static_transform_broadcaster.h>
#include <diagnostic_updater/diagnostic_updater.h>
#include <mavconn/interface.h>
#include <mavros/utils.h>
#include <mavros/frame_tf.h>
#include <GeographicLib/Geoid.hpp>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/NavSatFix.h>
Go to the source code of this file.
Classes | |
class | mavros::UAS |
UAS for plugins. More... | |
Namespaces | |
mavros | |
Macros | |
#define | UAS_DIAG(uasobjptr) ((uasobjptr)->diag_updater) |
helper accessor to diagnostic updater More... | |
#define | UAS_FCU(uasobjptr) ((uasobjptr)->fcu_link) |
helper accessor to FCU link interface More... | |
MAVROS Plugin context.
Definition in file mavros_uas.h.