, including all inherited members.
addTransformsChangedListener(boost::function< void(void)> callback) | tf::Transformer | |
allFramesAsDot() const | tf::Transformer | |
allFramesAsString() const | tf::Transformer | |
cache_time | tf::Transformer | [protected] |
cache_time_ | tf::Transformer | [protected] |
canTransform(const std::string &target_frame, const std::string &source_frame, const ros::Time &time, std::string *error_msg=NULL) const | tf::Transformer | |
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 | tf::Transformer | |
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 | tf::Transformer | |
clear() | tf::Transformer | |
cov_mutex_ | uncertain_tf::UncertainTransformer | [mutable, protected] |
covariances_ | uncertain_tf::UncertainTransformer | [protected] |
DEFAULT_CACHE_TIME | tf::Transformer | [static] |
DEFAULT_MAX_EXTRAPOLATION_DISTANCE | tf::Transformer | [static] |
fall_back_to_wall_time_ | tf::Transformer | |
frame_authority_ | tf::Transformer | [protected] |
frame_mutex_ | tf::Transformer | [protected] |
frameExists(const std::string &frame_id_str) const | tf::Transformer | |
frameIDs_ | tf::Transformer | [protected] |
frameIDs_reverse | tf::Transformer | [protected] |
frames_ | tf::Transformer | [protected] |
getCacheLength() | tf::Transformer | |
getCovariance(unsigned int frame_number) | uncertain_tf::UncertainTransformer | [protected] |
getFrame(unsigned int frame_number) const | tf::Transformer | [protected] |
getFrames(tf::FrameGraph::Request &req, tf::FrameGraph::Response &res) | tf::TransformListener | |
getFrameStrings(std::vector< std::string > &ids) const | tf::Transformer | |
getLatestCommonTime(const std::string &source_frame, const std::string &target_frame, ros::Time &time, std::string *error_string) const | tf::Transformer | |
getParent(const std::string &frame_id, ros::Time time, std::string &parent) const | tf::Transformer | |
getTFPrefix() const | tf::Transformer | |
interpolating | tf::Transformer | [protected] |
isUsingDedicatedThread() | tf::Transformer | |
lookupFrameNumber(const std::string &frameid_str) const | tf::Transformer | [protected] |
lookupFrameString(unsigned int frame_id_num) const | tf::Transformer | [protected] |
lookupOrInsertFrameNumber(const std::string &frameid_str) | tf::Transformer | [protected] |
lookupTransform(const std::string &target_frame, const std::string &source_frame, const ros::Time &time, StampedTransform &transform) const | tf::Transformer | |
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, StampedTransform &transform) const | tf::Transformer | |
lookupTwist(const std::string &tracking_frame, const std::string &observation_frame, const std::string &reference_frame, const tf::Point &reference_point, const std::string &reference_point_frame, const ros::Time &time, const ros::Duration &averaging_interval, geometry_msgs::Twist &twist) const | tf::Transformer | |
lookupTwist(const std::string &tracking_frame, const std::string &observation_frame, const ros::Time &time, const ros::Duration &averaging_interval, geometry_msgs::Twist &twist) const | tf::Transformer | |
M_StringToCompactFrameID typedef | tf::Transformer | [protected] |
max_extrapolation_distance_ | tf::Transformer | [protected] |
MAX_GRAPH_DEPTH | tf::Transformer | [static] |
now() const | tf::Transformer | [protected] |
ok() const | tf::TransformListener | [protected, virtual] |
removeTransformsChangedListener(boost::signals::connection c) | tf::Transformer | |
resolve(const std::string &frame_name) | tf::TransformListener | |
setCovariance(const StampedCovariance &cov) | uncertain_tf::UncertainTransformer | [protected] |
setExtrapolationLimit(const ros::Duration &distance) | tf::Transformer | |
setTransform(const StampedTransform &transform, const std::string &authority="default_authority") | tf::Transformer | |
setUsingDedicatedThread(bool value) | tf::Transformer | |
tf_prefix_ | tf::Transformer | [protected] |
Transformer(bool interpolating=true, ros::Duration cache_time_=ros::Duration(DEFAULT_CACHE_TIME)) | tf::Transformer | |
TransformListener(ros::Duration max_cache_time=ros::Duration(DEFAULT_CACHE_TIME), bool spin_thread=true) | tf::TransformListener | |
TransformListener(const ros::NodeHandle &nh, ros::Duration max_cache_time=ros::Duration(DEFAULT_CACHE_TIME), bool spin_thread=true) | tf::TransformListener | |
transformPoint(const std::string &target_frame, const geometry_msgs::PointStamped &stamped_in, geometry_msgs::PointStamped &stamped_out) const | tf::TransformListener | |
transformPoint(const std::string &target_frame, const ros::Time &target_time, const geometry_msgs::PointStamped &pin, const std::string &fixed_frame, geometry_msgs::PointStamped &pout) const | tf::TransformListener | |
tf::Transformer::transformPoint(const std::string &target_frame, const Stamped< tf::Point > &stamped_in, Stamped< tf::Point > &stamped_out) const | tf::Transformer | |
tf::Transformer::transformPoint(const std::string &target_frame, const ros::Time &target_time, const Stamped< tf::Point > &stamped_in, const std::string &fixed_frame, Stamped< tf::Point > &stamped_out) const | tf::Transformer | |
transformPointCloud(const std::string &target_frame, const sensor_msgs::PointCloud &pcin, sensor_msgs::PointCloud &pcout) const | tf::TransformListener | |
transformPointCloud(const std::string &target_frame, const ros::Time &target_time, const sensor_msgs::PointCloud &pcin, const std::string &fixed_frame, sensor_msgs::PointCloud &pcout) const | tf::TransformListener | |
transformPose(const std::string &target_frame, const geometry_msgs::PoseStamped &stamped_in, geometry_msgs::PoseStamped &stamped_out) const | tf::TransformListener | |
transformPose(const std::string &target_frame, const ros::Time &target_time, const geometry_msgs::PoseStamped &pin, const std::string &fixed_frame, geometry_msgs::PoseStamped &pout) const | tf::TransformListener | |
tf::Transformer::transformPose(const std::string &target_frame, const Stamped< tf::Pose > &stamped_in, Stamped< tf::Pose > &stamped_out) const | tf::Transformer | |
tf::Transformer::transformPose(const std::string &target_frame, const ros::Time &target_time, const Stamped< tf::Pose > &stamped_in, const std::string &fixed_frame, Stamped< tf::Pose > &stamped_out) const | tf::Transformer | |
transformQuaternion(const std::string &target_frame, const geometry_msgs::QuaternionStamped &stamped_in, geometry_msgs::QuaternionStamped &stamped_out) const | tf::TransformListener | |
transformQuaternion(const std::string &target_frame, const ros::Time &target_time, const geometry_msgs::QuaternionStamped &qin, const std::string &fixed_frame, geometry_msgs::QuaternionStamped &qout) const | tf::TransformListener | |
tf::Transformer::transformQuaternion(const std::string &target_frame, const Stamped< tf::Quaternion > &stamped_in, Stamped< tf::Quaternion > &stamped_out) const | tf::Transformer | |
tf::Transformer::transformQuaternion(const std::string &target_frame, const ros::Time &target_time, const Stamped< tf::Quaternion > &stamped_in, const std::string &fixed_frame, Stamped< tf::Quaternion > &stamped_out) const | tf::Transformer | |
transforms_changed_ | tf::Transformer | [protected] |
transforms_changed_mutex_ | tf::Transformer | [protected] |
TransformsChangedSignal typedef | tf::Transformer | [protected] |
transformVector(const std::string &target_frame, const geometry_msgs::Vector3Stamped &stamped_in, geometry_msgs::Vector3Stamped &stamped_out) const | tf::TransformListener | |
transformVector(const std::string &target_frame, const ros::Time &target_time, const geometry_msgs::Vector3Stamped &vin, const std::string &fixed_frame, geometry_msgs::Vector3Stamped &vout) const | tf::TransformListener | |
tf::Transformer::transformVector(const std::string &target_frame, const Stamped< tf::Vector3 > &stamped_in, Stamped< tf::Vector3 > &stamped_out) const | tf::Transformer | |
tf::Transformer::transformVector(const std::string &target_frame, const ros::Time &target_time, const Stamped< tf::Vector3 > &stamped_in, const std::string &fixed_frame, Stamped< tf::Vector3 > &stamped_out) const | tf::Transformer | |
using_dedicated_thread_ | tf::Transformer | [protected] |
waitForTransform(const std::string &target_frame, const std::string &source_frame, const ros::Time &time, const ros::Duration &timeout, const ros::Duration &polling_sleep_duration=ros::Duration(0.01), std::string *error_msg=NULL) const | tf::Transformer | |
waitForTransform(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 ros::Duration &polling_sleep_duration=ros::Duration(0.01), std::string *error_msg=NULL) const | tf::Transformer | |
~Transformer(void) | tf::Transformer | [virtual] |
~TransformListener() | tf::TransformListener | |