ROS与C 入门教程-tf-坐标变换说明:
概念:
参考:
Frames and Points
其余参考原文:http://wiki./tf/Overview/Transformations ROS与C 入门教程-tf-广播变换说明:
广播变换:
构造器
tf::TransformBroadcaster(); 发送变换
void sendTransform(const StampedTransform & transform); void sendTransform(const geometry_msgs::TransformStamped & transform); ROS与C 入门教程-tf-使用已发布的变换说明:
TransformListener
核心方法 (1)构造函数
TransformListener(const ros::NodeHandle &nh, ros::Duration max_cache_time=ros::Duration(DEFAULT_CACHE_TIME), bool spin_thread=true) TransformListener(ros::Duration max_cache_time=ros::Duration(DEFAULT_CACHE_TIME), bool spin_thread=true) (2)辅助方法
std::string tf::TransformListener::resolve (const std::string &frame_id)
(3)canTransform()函数
bool tf::TransformListener::canTransform (const std::string &target_frame, const std::string &source_frame, const ros::Time &time, std::string *error_msg=NULL) const
bool tf::TransformListener::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
(4)waitForTransform()函数
bool tf::TransformListener::waitForTransform (const std::string &target_frame, const std::string &source_frame, const ros::Time &time, const ros::Duration &timeout,
bool tf::TransformListener::waitForTransform (const std::string &target_frame, const ros::Time &target_time, const std::string &source_frame, const ros::Time &source_time,
(5)lookupTransform
void tf::TransformListener::lookupTransform (const std::string &target_frame, const std::string &source_frame, const ros::Time &time, StampedTransform &transform) const
void tf::TransformListener::lookupTransform (const std::string &target_frame, const ros::Time &target_time, const std::string &source_frame, const ros::Time &source_time,
transformDATA 方法
void tf::TransformListener::transformDATATYPE (const std::string &target_frame, const geometry_msgs::DATATYPEStamped &stamped_in, geometry_msgs::DATATYPEStamped &stamped_out) const
void tf::TransformListener::transformDATATYPE (const std::string &target_frame, const ros::Time &target_time, const geometry_msgs::DATATYPEStamped &pin,
ROS与C 入门教程-tf-异常说明:
TF异常
异常类型:
|
|