This mixin adds TF listener to plugin. More...
#include <setpoint_mixin.h>
Public Member Functions | |
void | tf_listener (void) |
void | tf_start (const char *_thd_name, void(D::*cbp)(const tf::Transform &, const ros::Time &)) |
start tf listener | |
Public Attributes | |
std::thread | tf_thread |
boost::function< void(const tf::Transform &, const ros::Time &)> | tf_transform_cb |
std::string | thd_name |
This mixin adds TF listener to plugin.
It requires ros::NodeHandle named sp_nh, frame_id and child_frame_id strings and tf_rate double.
Definition at line 72 of file setpoint_mixin.h.