#include <polygon.h>
Public Member Functions | |
| float | dist (const Vec &a) const |
| bool | inside (const Vec &a) const |
| void | move (const float &x, const float &y, const float &yaw) |
| Polygon () | |
| Polygon (const XmlRpc::XmlRpcValue footprint_xml_const) | |
| float | radius () const |
| geometry_msgs::PolygonStamped | toMsg () const |
Public Attributes | |
| std::vector< Vec > | v |
| costmap_cspace::Polygon::Polygon | ( | ) | [inline] |
| costmap_cspace::Polygon::Polygon | ( | const XmlRpc::XmlRpcValue | footprint_xml_const | ) | [inline, explicit] |
| float costmap_cspace::Polygon::dist | ( | const Vec & | a | ) | const [inline] |
| bool costmap_cspace::Polygon::inside | ( | const Vec & | a | ) | const [inline] |
| void costmap_cspace::Polygon::move | ( | const float & | x, |
| const float & | y, | ||
| const float & | yaw | ||
| ) | [inline] |
| float costmap_cspace::Polygon::radius | ( | ) | const [inline] |
| geometry_msgs::PolygonStamped costmap_cspace::Polygon::toMsg | ( | ) | const [inline] |
| std::vector<Vec> costmap_cspace::Polygon::v |