#include <nav_core2/common.h>
#include <nav_2d_utils/conversions.h>
#include <geometry_msgs/PoseStamped.h>
#include <nav_2d_msgs/Pose2DStamped.h>
#include <string>
Go to the source code of this file.
|
| nav_2d_utils |
| A set of utility functions for Bounds objects interacting with other messages/types.
|
|
|
bool | nav_2d_utils::transformPose (const TFListenerPtr tf, const std::string frame, const geometry_msgs::PoseStamped &in_pose, geometry_msgs::PoseStamped &out_pose, const bool extrapolation_fallback=true) |
| Transform a PoseStamped from one frame to another while catching exceptions. More...
|
|
bool | nav_2d_utils::transformPose (const TFListenerPtr tf, const std::string frame, const nav_2d_msgs::Pose2DStamped &in_pose, nav_2d_msgs::Pose2DStamped &out_pose, const bool extrapolation_fallback=true) |
| Transform a Pose2DStamped from one frame to another while catching exceptions. More...
|
|
geometry_msgs::Pose2D | nav_2d_utils::transformStampedPose (const TFListenerPtr tf, const nav_2d_msgs::Pose2DStamped &pose, const std::string &frame_id) |
|