#include "gtest/gtest.h"#include <imu_transformer/tf2_sensor_msgs.h>#include <sensor_msgs/Imu.h>#include <sensor_msgs/MagneticField.h>#include <tf2/LinearMath/Quaternion.h>#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
Go to the source code of this file.
Functions | |
| void | compareCovariances (const boost::array< double, 9 > &c1, const boost::array< double, 9 > &c2) |
| int | main (int argc, char **argv) |
| void | prepareImuMsg (sensor_msgs::Imu &msg) |
| void | prepareMagMsg (sensor_msgs::MagneticField &msg) |
| void | prepareTf (geometry_msgs::TransformStamped &tf) |
| TEST (Covariance, Transform) | |
| TEST (Imu, DoTransformEnuNed) | |
| TEST (Imu, DoTransformYaw) | |
| TEST (Imu, GetFrameId) | |
| TEST (Imu, GetTimestamp) | |
| TEST (Mag, DoTransformEnuNed) | |
| TEST (Mag, DoTransformYaw) | |
| TEST (Mag, GetFrameId) | |
| TEST (Mag, GetTimestamp) | |
Definition in file test_imu_transforms.cpp.
| void compareCovariances | ( | const boost::array< double, 9 > & | c1, |
| const boost::array< double, 9 > & | c2 | ||
| ) |
Definition at line 17 of file test_imu_transforms.cpp.
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 271 of file test_imu_transforms.cpp.
| void prepareImuMsg | ( | sensor_msgs::Imu & | msg | ) |
Definition at line 87 of file test_imu_transforms.cpp.
| void prepareMagMsg | ( | sensor_msgs::MagneticField & | msg | ) |
Definition at line 209 of file test_imu_transforms.cpp.
| void prepareTf | ( | geometry_msgs::TransformStamped & | tf | ) |
Definition at line 103 of file test_imu_transforms.cpp.
| TEST | ( | Covariance | , |
| Transform | |||
| ) |
Definition at line 23 of file test_imu_transforms.cpp.
| TEST | ( | Imu | , |
| DoTransformEnuNed | |||
| ) |
Definition at line 153 of file test_imu_transforms.cpp.
| TEST | ( | Imu | , |
| DoTransformYaw | |||
| ) |
Definition at line 114 of file test_imu_transforms.cpp.
| TEST | ( | Imu | , |
| GetFrameId | |||
| ) |
Definition at line 79 of file test_imu_transforms.cpp.
| TEST | ( | Imu | , |
| GetTimestamp | |||
| ) |
Definition at line 70 of file test_imu_transforms.cpp.
| TEST | ( | Mag | , |
| DoTransformEnuNed | |||
| ) |
Definition at line 245 of file test_imu_transforms.cpp.
| TEST | ( | Mag | , |
| DoTransformYaw | |||
| ) |
Definition at line 219 of file test_imu_transforms.cpp.
| TEST | ( | Mag | , |
| GetFrameId | |||
| ) |
Definition at line 201 of file test_imu_transforms.cpp.
| TEST | ( | Mag | , |
| GetTimestamp | |||
| ) |
Definition at line 192 of file test_imu_transforms.cpp.