#include <graph_mapping_utils/geometry.h>
#include <boost/foreach.hpp>
#include <stdexcept>
Go to the source code of this file.
Namespaces | |
namespace | graph_mapping_utils |
Functions | |
btVector3 | graph_mapping_utils::barycenter (const sm::LaserScan &scan) |
gm::Point | graph_mapping_utils::barycenter (const sensor_msgs::PointCloud &cloud) |
Return the barycenter of the cloud, in the same frame as the cloud itself. | |
tf::Pose | graph_mapping_utils::makePose (double x, double y, double theta) |
Construct a tf::Pose from x,y,theta. | |
gm::Pose2D | graph_mapping_utils::makePose2D (double x, double y, double theta=0.0) |
Construct a pose2d. | |
gm::Pose2D | graph_mapping_utils::projectToPose2D (const gm::Pose &pose) |
Project Pose to Pose2D. | |
gm::Pose2D | graph_mapping_utils::projectToPose2D (const tf::Transform &pose) |
tf::Pose | graph_mapping_utils::toPose (const gm::Pose2D &p) |
Make a pose from a pose2d. |
Implementation of geometry.h
Definition in file geometry.cpp.