IMU publish plugin. More...
#include <cmath>#include <mavros/mavros_plugin.h>#include <pluginlib/class_list_macros.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>
Go to the source code of this file.
| Classes | |
| class | mavplugin::IMUPubPlugin | 
| IMU data publication plugin.  More... | |
| Namespaces | |
| namespace | mavplugin | 
| Variables | |
| static constexpr double | mavplugin::GAUSS_TO_TESLA = 1.0e-4 | 
| Gauss to Tesla coeff. | |
| static constexpr double | mavplugin::MILLIBAR_TO_PASCAL = 1.0e2 | 
| millBar to Pascal coeff | |
| static constexpr double | mavplugin::MILLIG_TO_MS2 = 9.80665 / 1000.0 | 
| millG to m/s**2 coeff | |
| static constexpr double | mavplugin::MILLIRS_TO_RADSEC = 1.0e-3 | 
| millRad/Sec to Rad/Sec coeff | |
| static constexpr double | mavplugin::MILLIT_TO_TESLA = 1000.0 | 
| millTesla to Tesla coeff | |
| static constexpr double | mavplugin::RAD_TO_DEG = 180.0 / M_PI | 
IMU publish plugin.
Definition in file imu_pub.cpp.