#include <string>#include <vector>#include <ros/ros.h>#include <nav_msgs/Odometry.h>#include <sensor_msgs/Imu.h>#include <tf2/utils.h>#include <tf2_geometry_msgs/tf2_geometry_msgs.h>#include <gtest/gtest.h>
Go to the source code of this file.
Classes | |
| class | TrackOdometryTest |
Functions | |
| INSTANTIATE_TEST_CASE_P (TrackOdometryTestInstance, TrackOdometryTest,::testing::Values("","_old_param")) | |
| int | main (int argc, char **argv) |
| TEST_F (TrackOdometryTest, OdomImuFusion) | |
| TEST_P (TrackOdometryTest, ZFilterOff) | |
| TEST_P (TrackOdometryTest, ZFilterOn) | |
| INSTANTIATE_TEST_CASE_P | ( | TrackOdometryTestInstance | , |
| TrackOdometryTest | , | ||
| ::testing::Values("","_old_param") | |||
| ) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 302 of file test_track_odometry.cpp.
| TEST_F | ( | TrackOdometryTest | , |
| OdomImuFusion | |||
| ) |
Definition at line 168 of file test_track_odometry.cpp.
| TEST_P | ( | TrackOdometryTest | , |
| ZFilterOff | |||
| ) |
Definition at line 232 of file test_track_odometry.cpp.
| TEST_P | ( | TrackOdometryTest | , |
| ZFilterOn | |||
| ) |
Definition at line 266 of file test_track_odometry.cpp.