IMU and attitude data parser plugin. More...
#include <cmath>
#include <mavros/mavros_plugin.h>
#include <eigen_conversions/eigen_msg.h>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/MagneticField.h>
#include <sensor_msgs/Temperature.h>
#include <sensor_msgs/FluidPressure.h>
#include <geometry_msgs/Vector3.h>
#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Classes | |
class | mavros::std_plugins::IMUPlugin |
IMU and attitude data publication plugin. More... | |
Namespaces | |
mavros | |
mavros::std_plugins | |
Variables | |
static constexpr double | mavros::std_plugins::GAUSS_TO_TESLA = 1.0e-4 |
Gauss to Tesla coeff. More... | |
static constexpr double | mavros::std_plugins::MILLIBAR_TO_PASCAL = 1.0e2 |
millBar to Pascal coeff More... | |
static constexpr double | mavros::std_plugins::MILLIG_TO_MS2 = 9.80665 / 1000.0 |
millG to m/s**2 coeff More... | |
static constexpr double | mavros::std_plugins::MILLIMS2_TO_MS2 = 1.0e-3 |
millm/s**2 to m/s**2 coeff More... | |
static constexpr double | mavros::std_plugins::MILLIRS_TO_RADSEC = 1.0e-3 |
millRad/Sec to Rad/Sec coeff More... | |
static constexpr double | mavros::std_plugins::MILLIT_TO_TESLA = 1000.0 |
millTesla to Tesla coeff More... | |
static constexpr double | mavros::std_plugins::RAD_TO_DEG = 180.0 / M_PI |
Radians to degrees. More... | |
IMU and attitude data parser plugin.
Definition in file imu.cpp.