Public Member Functions | |
void | ekfCallback (const nav_msgs::OdometryConstPtr &ekf_msg) |
void | gpsCallback (const sensor_msgs::NavSatFixConstPtr &msg) |
void | headingCallback (const sensor_msgs::ImuConstPtr &heading_msg) |
void | init () |
RemoveLatency (const ros::NodeHandle &node_handle, const ros::NodeHandle &private_node_handle) | |
~RemoveLatency ()=default | |
Public Attributes | |
double | ekf_latency_ {0.0} |
ros::Publisher | ekf_pub_ |
ros::Subscriber | ekf_sub_ |
double | gps_latency_ {0.0} |
ros::Publisher | gps_pub_ |
ros::Subscriber | gps_sub_ |
ros::Publisher | heading_pub_ |
ros::Subscriber | heading_sub_ |
ros::NodeHandle | nh_ |
ros::NodeHandle | pnh_ |
Definition at line 15 of file remove_latency.cpp.
|
inline |
Definition at line 18 of file remove_latency.cpp.
|
default |
void RemoveLatency::ekfCallback | ( | const nav_msgs::OdometryConstPtr & | ekf_msg | ) |
Definition at line 91 of file remove_latency.cpp.
void RemoveLatency::gpsCallback | ( | const sensor_msgs::NavSatFixConstPtr & | msg | ) |
Definition at line 63 of file remove_latency.cpp.
void RemoveLatency::headingCallback | ( | const sensor_msgs::ImuConstPtr & | heading_msg | ) |
Definition at line 77 of file remove_latency.cpp.
void RemoveLatency::init | ( | ) |
Definition at line 44 of file remove_latency.cpp.
double RemoveLatency::ekf_latency_ {0.0} |
Definition at line 31 of file remove_latency.cpp.
ros::Publisher RemoveLatency::ekf_pub_ |
Definition at line 41 of file remove_latency.cpp.
ros::Subscriber RemoveLatency::ekf_sub_ |
Definition at line 38 of file remove_latency.cpp.
double RemoveLatency::gps_latency_ {0.0} |
Definition at line 30 of file remove_latency.cpp.
ros::Publisher RemoveLatency::gps_pub_ |
Definition at line 39 of file remove_latency.cpp.
ros::Subscriber RemoveLatency::gps_sub_ |
Definition at line 36 of file remove_latency.cpp.
ros::Publisher RemoveLatency::heading_pub_ |
Definition at line 40 of file remove_latency.cpp.
ros::Subscriber RemoveLatency::heading_sub_ |
Definition at line 37 of file remove_latency.cpp.
ros::NodeHandle RemoveLatency::nh_ |
Definition at line 33 of file remove_latency.cpp.
ros::NodeHandle RemoveLatency::pnh_ |
Definition at line 34 of file remove_latency.cpp.