#include <tf_pair.h>
Public Member Functions | |
float | getAngularThres () |
const std::string | getID () |
const std::string & | getSourceFrame () const |
const std::string & | getTargetFrame () const |
float | getTransThres () |
void | setAngularThres (float angular_thres) |
void | setSourceFrame (const std::string &source_frame) |
void | setTargetFrame (const std::string &target_frame) |
void | setTransThres (float trans_thres) |
TFPair () | |
TFPair (const std::string &source_frame, const std::string &target_frame, float angular_thres=0.0f, float trans_thres=0.0f) | |
void | transmissionTriggered () |
bool | updateNeeded () |
void | updateTransform (geometry_msgs::TransformStamped &update) |
~TFPair () | |
Private Attributes | |
float | angular_thres_ |
bool | first_transmission_ |
std::string | source_frame_ |
std::string | target_frame_ |
tf::Transform | tf_received_ |
tf::Transform | tf_transmitted_ |
float | trans_thres_ |
bool | updated_ |
TFPair::TFPair | ( | ) | [inline] |
TFPair::TFPair | ( | const std::string & | source_frame, |
const std::string & | target_frame, | ||
float | angular_thres = 0.0f , |
||
float | trans_thres = 0.0f |
||
) | [inline] |
TFPair::~TFPair | ( | ) | [inline] |
float TFPair::getAngularThres | ( | ) | [inline] |
const std::string TFPair::getID | ( | ) | [inline] |
const std::string& TFPair::getSourceFrame | ( | ) | const [inline] |
const std::string& TFPair::getTargetFrame | ( | ) | const [inline] |
float TFPair::getTransThres | ( | ) | [inline] |
void TFPair::setAngularThres | ( | float | angular_thres | ) | [inline] |
void TFPair::setSourceFrame | ( | const std::string & | source_frame | ) | [inline] |
void TFPair::setTargetFrame | ( | const std::string & | target_frame | ) | [inline] |
void TFPair::setTransThres | ( | float | trans_thres | ) | [inline] |
void TFPair::transmissionTriggered | ( | ) | [inline] |
bool TFPair::updateNeeded | ( | ) | [inline] |
void TFPair::updateTransform | ( | geometry_msgs::TransformStamped & | update | ) | [inline] |
float TFPair::angular_thres_ [private] |
bool TFPair::first_transmission_ [private] |
std::string TFPair::source_frame_ [private] |
std::string TFPair::target_frame_ [private] |
tf::Transform TFPair::tf_received_ [private] |
tf::Transform TFPair::tf_transmitted_ [private] |
float TFPair::trans_thres_ [private] |
bool TFPair::updated_ [private] |