#include <ros/ros.h>#include <ros/node_handle.h>#include <diagnostic_updater/diagnostic_updater.h>#include <diagnostic_updater/publisher.h>#include <sensor_msgs/Imu.h>#include <sensor_msgs/MagneticField.h>#include <sensor_msgs/FluidPressure.h>#include <geometry_msgs/Vector3Stamped.h>#include <geometry_msgs/QuaternionStamped.h>#include <thormang3_imu_3dm_gx4/FilterOutput.h>#include "thormang3_imu_3dm_gx4/imu.hpp"
Go to the source code of this file.
Macros | |
| #define | kEarthGravity (9.80665) |
Functions | |
| std::shared_ptr< diagnostic_updater::TopicDiagnostic > | configTopicDiagnostic (const std::string &name, double *target) |
| int | main (int argc, char **argv) |
| void | publishData (const Imu::IMUData &data) |
| void | publishFilter (const Imu::FilterData &data) |
| void | updateDiagnosticInfo (diagnostic_updater::DiagnosticStatusWrapper &stat, imu_3dm_gx4::Imu *imu) |
Variables | |
| Imu::DiagnosticFields | fields |
| std::shared_ptr< diagnostic_updater::TopicDiagnostic > | filterDiag |
| std::string | frameId |
| std::shared_ptr< diagnostic_updater::TopicDiagnostic > | imuDiag |
| sensor_msgs::Imu | imuFilterData |
| Imu::Info | info |
| ros::Publisher | pubFilter |
| ros::Publisher | pubIMU |
| ros::Publisher | pubMag |
| ros::Publisher | pubPressure |
| std::shared_ptr< diagnostic_updater::Updater > | updater |
| #define kEarthGravity (9.80665) |
Definition at line 18 of file imu_3dm_gx4.cpp.
| std::shared_ptr<diagnostic_updater::TopicDiagnostic> configTopicDiagnostic | ( | const std::string & | name, |
| double * | target | ||
| ) |
Definition at line 124 of file imu_3dm_gx4.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 162 of file imu_3dm_gx4.cpp.
| void publishData | ( | const Imu::IMUData & | data | ) |
Definition at line 35 of file imu_3dm_gx4.cpp.
| void publishFilter | ( | const Imu::FilterData & | data | ) |
Definition at line 81 of file imu_3dm_gx4.cpp.
| void updateDiagnosticInfo | ( | diagnostic_updater::DiagnosticStatusWrapper & | stat, |
| imu_3dm_gx4::Imu * | imu | ||
| ) |
Definition at line 138 of file imu_3dm_gx4.cpp.
| Imu::DiagnosticFields fields |
Definition at line 28 of file imu_3dm_gx4.cpp.
| std::shared_ptr<diagnostic_updater::TopicDiagnostic> filterDiag |
Definition at line 33 of file imu_3dm_gx4.cpp.
| std::string frameId |
Definition at line 24 of file imu_3dm_gx4.cpp.
| std::shared_ptr<diagnostic_updater::TopicDiagnostic> imuDiag |
Definition at line 32 of file imu_3dm_gx4.cpp.
| sensor_msgs::Imu imuFilterData |
Definition at line 25 of file imu_3dm_gx4.cpp.
| Imu::Info info |
Definition at line 27 of file imu_3dm_gx4.cpp.
| ros::Publisher pubFilter |
Definition at line 23 of file imu_3dm_gx4.cpp.
| ros::Publisher pubIMU |
Definition at line 20 of file imu_3dm_gx4.cpp.
| ros::Publisher pubMag |
Definition at line 21 of file imu_3dm_gx4.cpp.
| ros::Publisher pubPressure |
Definition at line 22 of file imu_3dm_gx4.cpp.
| std::shared_ptr<diagnostic_updater::Updater> updater |
Definition at line 31 of file imu_3dm_gx4.cpp.