#include <ros/ros.h>
#include <geometry_msgs/Polygon.h>
#include <geometry_msgs/Point.h>
#include <geometry_msgs/Point32.h>
Go to the source code of this file.
Namespaces | |
namespace | costmap_2d |
Functions | |
void | costmap_2d::calculateMinAndMaxDistances (const std::vector< geometry_msgs::Point > &footprint, double &min_dist, double &max_dist) |
geometry_msgs::Point | costmap_2d::toPoint (geometry_msgs::Point32 pt) |
geometry_msgs::Point32 | costmap_2d::toPoint32 (geometry_msgs::Point pt) |
std::vector< geometry_msgs::Point > | costmap_2d::toPointVector (geometry_msgs::Polygon polygon) |
geometry_msgs::Polygon | costmap_2d::toPolygon (std::vector< geometry_msgs::Point > pts) |