Namespaces | Functions
navigation_utility.cpp File Reference
#include <tf/tf.h>
#include "mbf_utility/navigation_utility.h"
#include <cmath>
Include dependency graph for navigation_utility.cpp:

Go to the source code of this file.

Namespaces

 mbf_utility
 

Functions

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...
 
static bool mbf_utility::isNormalized (const geometry_msgs::Quaternion &_q, double _epsilon)
 Returns true, if the given quaternion is normalized. More...
 
bool mbf_utility::transformPoint (const TF &tf, const std::string &target_frame, const ros::Duration &timeout, const geometry_msgs::PointStamped &in, 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::Duration &timeout, const geometry_msgs::PoseStamped &in, geometry_msgs::PoseStamped &out)
 Transforms a pose from one frame into another. More...
 


mbf_utility
Author(s): Sebastian Pütz
autogenerated on Mon Feb 28 2022 22:49:48