#include <lama_common/angular_point.h>#include <lama_common/polygon_utils.h>#include <ros/ros.h>#include <fstream>#include <iostream>
Go to the source code of this file.
Namespaces | |
| namespace | lama_common |
Functions | |
| geometry_msgs::Polygon | lama_common::centeredPolygon (const geometry_msgs::Polygon &polygon) |
| geometry_msgs::Polygon | lama_common::centeredPolygon (const geometry_msgs::Polygon &polygon, double &dx, double &dy) |
| void | lama_common::centerPolygon (geometry_msgs::Polygon &polygon) |
| void | lama_common::centerPolygon (geometry_msgs::Polygon &polygon, double &dx, double &dy) |
| bool | lama_common::isClosed (const geometry_msgs::Polygon &poly, double max_frontier_width) |
| static bool | lama_common::normalizablePolygon (const vector< AngularPoint > &angular_points) |
| geometry_msgs::Polygon | lama_common::normalizedPolygon (const geometry_msgs::Polygon &poly, bool &normalized) |
| bool | lama_common::normalizePolygon (geometry_msgs::Polygon &poly) |