Go to the documentation of this file.
38 #include <tf/tfMessage.h>
55 TFPair(
const std::string& source_frame,
56 const std::string& target_frame,
57 float angular_thres = 0.0
f,
58 float trans_thres = 0.0
f) :
149 const std::string
getID()
void transmissionTriggered()
void setAngularThres(float angular_thres)
void setSourceFrame(const std::string &source_frame)
std::string source_frame_
const std::string & getTargetFrame() const
tf::Transform tf_received_
static void transformMsgToTF(const geometry_msgs::Transform &msg, Transform &bt)
void updateTransform(geometry_msgs::TransformStamped &update)
tf::Transform tf_transmitted_
std::string target_frame_
const std::string getID()
void update(const std::string &key, const XmlRpc::XmlRpcValue &v)
boost::shared_ptr< TFPair > TFPairPtr
const std::string & getSourceFrame() const
void setTransThres(float trans_thres)
tfScalar angle(const Quaternion &q) const
void setTargetFrame(const std::string &target_frame)