Classes | |
| class | DissimilarityGetter |
Functions | |
| static void | getXMinMax (const geometry_msgs::Polygon &poly1, const geometry_msgs::Polygon &poly2, double &x_min, double &x_max) |
| static void | getYMinMax (const geometry_msgs::Polygon &poly1, const geometry_msgs::Polygon &poly2, double &y_min, double &y_max) |
| geometry_msgs::Polygon | rotatedPolygon (const geometry_msgs::Polygon &poly_in, double angle) |
| void | saveToFile (const std::string &filename, const geometry_msgs::Polygon &poly) |
| static void place_matcher_hist::getXMinMax | ( | const geometry_msgs::Polygon & | poly1, |
| const geometry_msgs::Polygon & | poly2, | ||
| double & | x_min, | ||
| double & | x_max | ||
| ) | [static] |
Definition at line 26 of file dissimilarity_getter.cpp.
| static void place_matcher_hist::getYMinMax | ( | const geometry_msgs::Polygon & | poly1, |
| const geometry_msgs::Polygon & | poly2, | ||
| double & | y_min, | ||
| double & | y_max | ||
| ) | [static] |
Definition at line 56 of file dissimilarity_getter.cpp.
| geometry_msgs::Polygon place_matcher_hist::rotatedPolygon | ( | const geometry_msgs::Polygon & | poly_in, |
| double | angle | ||
| ) | [inline] |
Return the polygon rotated with a given angle and around (0, 0).
Definition at line 88 of file dissimilarity_getter.cpp.
| void place_matcher_hist::saveToFile | ( | const std::string & | filename, |
| const geometry_msgs::Polygon & | poly | ||
| ) |
Definition at line 10 of file dissimilarity_getter.cpp.