Public Member Functions | Protected Member Functions | Protected Attributes | List of all members
TrackOdometryTest Class Reference
Inheritance diagram for TrackOdometryTest:
Inheritance graph
[legend]

Public Member Functions

void flushOdomMsgs ()
 
void initializeNode (const std::string &ns)
 
bool initializeTrackOdometry (nav_msgs::Odometry &odom_raw, sensor_msgs::Imu &imu)
 
bool run (nav_msgs::Odometry &odom_raw, sensor_msgs::Imu &imu, const double dt, const int steps)
 
void stepAndPublish (nav_msgs::Odometry &odom_raw, sensor_msgs::Imu &imu, const double dt)
 
void waitAndSpinOnce ()
 

Protected Member Functions

void cbOdom (const nav_msgs::Odometry::ConstPtr &msg)
 

Protected Attributes

nav_msgs::Odometry::ConstPtr odom_
 
size_t odom_cnt_
 
std::vector< nav_msgs::Odometry > odom_msg_buffer_
 
ros::Publisher pub_imu_
 
ros::Publisher pub_odom_
 
ros::Subscriber sub_odom_
 

Detailed Description

Definition at line 41 of file test_track_odometry.cpp.

Member Function Documentation

void TrackOdometryTest::cbOdom ( const nav_msgs::Odometry::ConstPtr &  msg)
inlineprotected

Definition at line 162 of file test_track_odometry.cpp.

void TrackOdometryTest::flushOdomMsgs ( )
inline

Definition at line 131 of file test_track_odometry.cpp.

void TrackOdometryTest::initializeNode ( const std::string &  ns)
inline

Definition at line 47 of file test_track_odometry.cpp.

bool TrackOdometryTest::initializeTrackOdometry ( nav_msgs::Odometry &  odom_raw,
sensor_msgs::Imu &  imu 
)
inline

Definition at line 54 of file test_track_odometry.cpp.

bool TrackOdometryTest::run ( nav_msgs::Odometry &  odom_raw,
sensor_msgs::Imu &  imu,
const double  dt,
const int  steps 
)
inline

Definition at line 75 of file test_track_odometry.cpp.

void TrackOdometryTest::stepAndPublish ( nav_msgs::Odometry &  odom_raw,
sensor_msgs::Imu &  imu,
const double  dt 
)
inline

Definition at line 112 of file test_track_odometry.cpp.

void TrackOdometryTest::waitAndSpinOnce ( )
inline

Definition at line 139 of file test_track_odometry.cpp.

Member Data Documentation

nav_msgs::Odometry::ConstPtr TrackOdometryTest::odom_
protected

Definition at line 159 of file test_track_odometry.cpp.

size_t TrackOdometryTest::odom_cnt_
protected

Definition at line 160 of file test_track_odometry.cpp.

std::vector<nav_msgs::Odometry> TrackOdometryTest::odom_msg_buffer_
protected

Definition at line 44 of file test_track_odometry.cpp.

ros::Publisher TrackOdometryTest::pub_imu_
protected

Definition at line 157 of file test_track_odometry.cpp.

ros::Publisher TrackOdometryTest::pub_odom_
protected

Definition at line 156 of file test_track_odometry.cpp.

ros::Subscriber TrackOdometryTest::sub_odom_
protected

Definition at line 158 of file test_track_odometry.cpp.


The documentation for this class was generated from the following file:


track_odometry
Author(s): Atsushi Watanabe
autogenerated on Wed May 12 2021 02:20:38