#include <geometry_msgs/PoseStamped.h>
#include <ros/duration.h>
#include <ros/time.h>
#include <string>
#include <tf/transform_listener.h>
#include <tf2/convert.h>
#include <tf2_ros/buffer.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <mbf_utility/types.h>
Go to the source code of this file.
|
double | mbf_utility::angle (const geometry_msgs::PoseStamped &pose1, const geometry_msgs::PoseStamped &pose2) |
| computes the smallest angle between two poses. More...
|
|
double | mbf_utility::distance (const geometry_msgs::PoseStamped &pose1, const geometry_msgs::PoseStamped &pose2) |
| Computes the Euclidean-distance between two poses. More...
|
|
bool | mbf_utility::getRobotPose (const TF &tf, const std::string &robot_frame, const std::string &global_frame, const ros::Duration &timeout, geometry_msgs::PoseStamped &robot_pose) |
| Computes the robot pose. More...
|
|
bool | mbf_utility::transformPoint (const TF &tf, const std::string &target_frame, const ros::Time &target_time, const ros::Duration &timeout, const geometry_msgs::PointStamped &in, const std::string &fixed_frame, geometry_msgs::PointStamped &out) |
| Transforms a point from one frame into another. More...
|
|
bool | mbf_utility::transformPose (const TF &tf, const std::string &target_frame, const ros::Time &target_time, const ros::Duration &timeout, const geometry_msgs::PoseStamped &in, const std::string &fixed_frame, geometry_msgs::PoseStamped &out) |
| Transforms a pose from one frame into another. More...
|
|