| _addTransformsChangedListener(boost::function< void(void)> callback) | tf2::BufferCore | |
| _allFramesAsDot(double current_time) const | tf2::BufferCore | |
| _allFramesAsDot() const | tf2::BufferCore | |
| _chainAsVector(const std::string &target_frame, ros::Time target_time, const std::string &source_frame, ros::Time source_time, const std::string &fixed_frame, std::vector< std::string > &output) const | tf2::BufferCore | |
| _frameExists(const std::string &frame_id_str) const | tf2::BufferCore | |
| _getFrameStrings(std::vector< std::string > &ids) const | tf2::BufferCore | |
| _getLatestCommonTime(CompactFrameID target_frame, CompactFrameID source_frame, ros::Time &time, std::string *error_string) const | tf2::BufferCore | |
| _getParent(const std::string &frame_id, ros::Time time, std::string &parent) const | tf2::BufferCore | |
| _lookupFrameNumber(const std::string &frameid_str) const | tf2::BufferCore | |
| _lookupOrInsertFrameNumber(const std::string &frameid_str) | tf2::BufferCore | |
| _removeTransformsChangedListener(boost::signals2::connection c) | tf2::BufferCore | |
| _validateFrameId(const char *function_name_arg, const std::string &frame_id) const | tf2::BufferCore | |
| addTransformableCallback(const TransformableCallback &cb) | tf2::BufferCore | |
| addTransformableRequest(TransformableCallbackHandle handle, const std::string &target_frame, const std::string &source_frame, ros::Time time) | tf2::BufferCore | |
| allFramesAsString() const | tf2::BufferCore | |
| allFramesAsYAML(double current_time) const | tf2::BufferCore | |
| allFramesAsYAML() const | tf2::BufferCore | |
| Buffer(ros::Duration cache_time=ros::Duration(BufferCore::DEFAULT_CACHE_TIME), bool debug=false) | tf2_ros::Buffer | |
| BufferCore(ros::Duration cache_time_=ros::Duration(DEFAULT_CACHE_TIME)) | tf2::BufferCore | |
| cancelTransformableRequest(TransformableRequestHandle handle) | tf2::BufferCore | |
| canTransform(const std::string &target_frame, const std::string &source_frame, const ros::Time &target_time, const ros::Duration timeout, std::string *errstr=NULL) const | tf2_ros::Buffer | [virtual] |
| canTransform(const std::string &target_frame, const ros::Time &target_time, const std::string &source_frame, const ros::Time &source_time, const std::string &fixed_frame, const ros::Duration timeout, std::string *errstr=NULL) const | tf2_ros::Buffer | [virtual] |
| tf2::BufferCore::canTransform(const std::string &target_frame, const std::string &source_frame, const ros::Time &time, std::string *error_msg=NULL) const | tf2::BufferCore | |
| tf2::BufferCore::canTransform(const std::string &target_frame, const ros::Time &target_time, const std::string &source_frame, const ros::Time &source_time, const std::string &fixed_frame, std::string *error_msg=NULL) const | tf2::BufferCore | |
| checkAndErrorDedicatedThreadPresent(std::string *errstr) const | tf2_ros::Buffer | [private] |
| clear() | tf2::BufferCore | |
| DEFAULT_CACHE_TIME | tf2::BufferCore | [static] |
| frames_server_ | tf2_ros::Buffer | [private] |
| getCacheLength() | tf2::BufferCore | |
| getFrames(tf2_msgs::FrameGraph::Request &req, tf2_msgs::FrameGraph::Response &res) | tf2_ros::Buffer | [private] |
| isUsingDedicatedThread() const | tf2::BufferCore | |
| lookupTransform(const std::string &target_frame, const std::string &source_frame, const ros::Time &time, const ros::Duration timeout) const | tf2_ros::Buffer | [virtual] |
| lookupTransform(const std::string &target_frame, const ros::Time &target_time, const std::string &source_frame, const ros::Time &source_time, const std::string &fixed_frame, const ros::Duration timeout) const | tf2_ros::Buffer | [virtual] |
| tf2::BufferCore::lookupTransform(const std::string &target_frame, const std::string &source_frame, const ros::Time &time) const | tf2::BufferCore | |
| tf2::BufferCore::lookupTransform(const std::string &target_frame, const ros::Time &target_time, const std::string &source_frame, const ros::Time &source_time, const std::string &fixed_frame) const | tf2::BufferCore | |
| MAX_GRAPH_DEPTH | tf2::BufferCore | [static] |
| removeTransformableCallback(TransformableCallbackHandle handle) | tf2::BufferCore | |
| setTransform(const geometry_msgs::TransformStamped &transform, const std::string &authority, bool is_static=false) | tf2::BufferCore | |
| setUsingDedicatedThread(bool value) | tf2::BufferCore | |
| transform(const T &in, T &out, const std::string &target_frame, ros::Duration timeout=ros::Duration(0.0)) const | tf2_ros::BufferInterface | [inline] |
| transform(const T &in, const std::string &target_frame, ros::Duration timeout=ros::Duration(0.0)) const | tf2_ros::BufferInterface | [inline] |
| transform(const A &in, B &out, const std::string &target_frame, ros::Duration timeout=ros::Duration(0.0)) const | tf2_ros::BufferInterface | [inline] |
| transform(const T &in, T &out, const std::string &target_frame, const ros::Time &target_time, const std::string &fixed_frame, ros::Duration timeout=ros::Duration(0.0)) const | tf2_ros::BufferInterface | [inline] |
| transform(const T &in, const std::string &target_frame, const ros::Time &target_time, const std::string &fixed_frame, ros::Duration timeout=ros::Duration(0.0)) const | tf2_ros::BufferInterface | [inline] |
| transform(const A &in, B &out, const std::string &target_frame, const ros::Time &target_time, const std::string &fixed_frame, ros::Duration timeout=ros::Duration(0.0)) const | tf2_ros::BufferInterface | [inline] |
| TransformableCallback typedef | tf2::BufferCore | |
| ~BufferCore(void) | tf2::BufferCore | [virtual] |