Public Member Functions | |
| void | initializeNode (const std::string &ns) |
| void | initializeTrackOdometry (nav_msgs::Odometry &odom_raw, sensor_msgs::Imu &imu) |
| bool | run (nav_msgs::Odometry &odom_raw, sensor_msgs::Imu &imu, const float dt, const int steps) |
| void | stepAndPublish (nav_msgs::Odometry &odom_raw, sensor_msgs::Imu &imu, const float dt) |
| void | waitAndSpinOnce () |
Protected Member Functions | |
| void | cbOdom (const nav_msgs::Odometry::ConstPtr &msg) |
Protected Attributes | |
| nav_msgs::Odometry::ConstPtr | odom_ |
| ros::Publisher | pub_imu_ |
| ros::Publisher | pub_odom_ |
| ros::Subscriber | sub_odom_ |
Definition at line 40 of file test_track_odometry.cpp.
| void TrackOdometryTest::cbOdom | ( | const nav_msgs::Odometry::ConstPtr & | msg | ) | [inline, protected] |
Definition at line 127 of file test_track_odometry.cpp.
| void TrackOdometryTest::initializeNode | ( | const std::string & | ns | ) | [inline] |
Definition at line 43 of file test_track_odometry.cpp.
| void TrackOdometryTest::initializeTrackOdometry | ( | nav_msgs::Odometry & | odom_raw, |
| sensor_msgs::Imu & | imu | ||
| ) | [inline] |
Definition at line 50 of file test_track_odometry.cpp.
| bool TrackOdometryTest::run | ( | nav_msgs::Odometry & | odom_raw, |
| sensor_msgs::Imu & | imu, | ||
| const float | dt, | ||
| const int | steps | ||
| ) | [inline] |
Definition at line 68 of file test_track_odometry.cpp.
| void TrackOdometryTest::stepAndPublish | ( | nav_msgs::Odometry & | odom_raw, |
| sensor_msgs::Imu & | imu, | ||
| const float | dt | ||
| ) | [inline] |
Definition at line 105 of file test_track_odometry.cpp.
| void TrackOdometryTest::waitAndSpinOnce | ( | ) | [inline] |
Definition at line 115 of file test_track_odometry.cpp.
nav_msgs::Odometry::ConstPtr TrackOdometryTest::odom_ [protected] |
Definition at line 125 of file test_track_odometry.cpp.
ros::Publisher TrackOdometryTest::pub_imu_ [protected] |
Definition at line 123 of file test_track_odometry.cpp.
ros::Publisher TrackOdometryTest::pub_odom_ [protected] |
Definition at line 122 of file test_track_odometry.cpp.
ros::Subscriber TrackOdometryTest::sub_odom_ [protected] |
Definition at line 124 of file test_track_odometry.cpp.