Classes | |
| class | DissimilarityGetter |
| class | Jockey |
Typedefs | |
| typedef boost::numeric::ublas::matrix < double > | matrix |
| typedef std::vector < geometry_msgs::Polygon > | polygon_list |
Functions | |
| bool | evolve (const geometry_msgs::Polygon &input, polygon_list &output, unsigned int max_sigma) |
| int | inpoly (const geometry_msgs::Polygon &poly, const geometry_msgs::Point32 &point) |
| double | minDistance (const matrix &compared, int start) |
| typedef boost::numeric::ublas::matrix<double> place_matcher_mcc::matrix |
Definition at line 38 of file dissimilarity_getter.h.
| typedef std::vector<geometry_msgs::Polygon> place_matcher_mcc::polygon_list |
Definition at line 39 of file dissimilarity_getter.h.
| bool place_matcher_mcc::evolve | ( | const geometry_msgs::Polygon & | input, |
| polygon_list & | output, | ||
| unsigned int | max_sigma | ||
| ) |
Evolve a polygon
| [in] | input | Polygon to evolve |
| [out] | output | List of evolved polygons with scales { 0, 1, .., max_sigma}. |
| [in] | max_sigma | Scale count. |
Definition at line 33 of file dissimilarity_getter.cpp.
| int place_matcher_mcc::inpoly | ( | const geometry_msgs::Polygon & | poly, |
| const geometry_msgs::Point32 & | point | ||
| ) |
Definition at line 9 of file dissimilarity_getter.cpp.
| double place_matcher_mcc::minDistance | ( | const matrix & | compared, |
| int | start | ||
| ) |
Return the minimal distance
Definition at line 70 of file dissimilarity_getter.cpp.