This mixin adds TF2 listener thread to plugin. More...
#include <setpoint_mixin.h>
Public Member Functions | |
void | tf2_start (const char *_thd_name, void(D::*cbp)(const geometry_msgs::TransformStamped &)) |
start tf listener | |
void | tf_listener (void) |
Public Attributes | |
std::string | tf_thd_name |
std::thread | tf_thread |
boost::function< void(const geometry_msgs::TransformStamped &)> | tf_transform_cb |
This mixin adds TF2 listener thread to plugin.
It requires tf_frame_id, tf_child_frame_id strings tf_rate double and uas object pointer
Definition at line 61 of file setpoint_mixin.h.