Class for using the TF component from C++. More...
#include <tf_interface.h>
Public Member Functions | |
bool | ready () |
Check if the operations are ready. More... | |
TFInterface (RTT::TaskContext *owner) | |
Add interfaces to a given taskcontext. More... | |
Public Attributes | |
RTT::OperationCaller< void(const geometry_msgs::TransformStamped &)> | broadcastStaticTransform |
RTT::OperationCaller< void(const std::vector< geometry_msgs::TransformStamped > &)> | broadcastStaticTransforms |
RTT::OperationCaller< void(const geometry_msgs::TransformStamped &)> | broadcastTransform |
RTT::OperationCaller< void(const std::vector< geometry_msgs::TransformStamped > &)> | broadcastTransforms |
RTT::OperationCaller< bool(const std::string &, const std::string &)> | canTransform |
RTT::OperationCaller< bool(const std::string &, const std::string &, const ros::Time &)> | canTransformAtTime |
RTT::OperationCaller< geometry_msgs::TransformStamped(const std::string &, const std::string &)> | lookupTransform |
RTT::OperationCaller< geometry_msgs::TransformStamped(const std::string &, const std::string &, const ros::Time &)> | lookupTransformAtTime |
Class for using the TF component from C++.
Definition at line 13 of file tf_interface.h.
|
inline |
Add interfaces to a given taskcontext.
Definition at line 16 of file tf_interface.h.
|
inline |
Check if the operations are ready.
Definition at line 37 of file tf_interface.h.
RTT::OperationCaller<void(const geometry_msgs::TransformStamped&)> rtt_tf::TFInterface::broadcastStaticTransform |
Definition at line 53 of file tf_interface.h.
RTT::OperationCaller<void(const std::vector<geometry_msgs::TransformStamped>&)> rtt_tf::TFInterface::broadcastStaticTransforms |
Definition at line 54 of file tf_interface.h.
RTT::OperationCaller<void(const geometry_msgs::TransformStamped&)> rtt_tf::TFInterface::broadcastTransform |
Definition at line 51 of file tf_interface.h.
RTT::OperationCaller<void(const std::vector<geometry_msgs::TransformStamped>&)> rtt_tf::TFInterface::broadcastTransforms |
Definition at line 52 of file tf_interface.h.
RTT::OperationCaller<bool(const std::string&, const std::string&)> rtt_tf::TFInterface::canTransform |
Definition at line 55 of file tf_interface.h.
RTT::OperationCaller<bool(const std::string&, const std::string&, const ros::Time&)> rtt_tf::TFInterface::canTransformAtTime |
Definition at line 56 of file tf_interface.h.
RTT::OperationCaller<geometry_msgs::TransformStamped(const std::string&, const std::string&)> rtt_tf::TFInterface::lookupTransform |
Definition at line 49 of file tf_interface.h.
RTT::OperationCaller<geometry_msgs::TransformStamped(const std::string&, const std::string&, const ros::Time&)> rtt_tf::TFInterface::lookupTransformAtTime |
Definition at line 50 of file tf_interface.h.