$search
#include <tf/transform_listener.h>#include <flirtlib_ros/flirtlib.h>

Go to the source code of this file.
Namespaces | |
| namespace | flirtlib_ros |
Functions | |
| gm::Pose | flirtlib_ros::getCurrentPose (const tf::TransformListener &tf, const std::string &frame) |
| tf::Transform | flirtlib_ros::getLaserOffset (const tf::TransformListener &tf) |
| Get transform from base_footprint and base_laser_link. | |
| template<typename T > | |
| T | flirtlib_ros::getPrivateParam (const std::string &name, const T &default_val) |
| gm::Pose | flirtlib_ros::makePose (double x, double y, double theta) |
| Create a 2d pose. | |
| tf::Pose | flirtlib_ros::poseMsgToTf (const gm::Pose &p) |
| Convert geometry_msgs::Pose to tf. | |
| gm::Pose | flirtlib_ros::tfTransformToPose (const tf::Transform &trans) |
| Convert tf transform to ros pose. | |
| gm::Pose | flirtlib_ros::transformPose (const tf::Transform &trans, const gm::Pose &pose) |
| Transform a pose using a tf transform. | |
| gm::Pose | flirtlib_ros::transformPose (const gm::Pose &p, const OrientedPoint2D &trans) |
| Transform a flirtlib 2d pose. | |
General utilities
Definition in file common.h.