#include <algorithm>
#include <limits>
#include <cmath>
#include <cassert>
#include <boost/numeric/ublas/matrix.hpp>
#include <lama_common/point.h>
#include <lama_common/polygon_utils.h>
#include <place_matcher_msgs/PolygonDissimilarity.h>
#include <ros/ros.h>
#include <std_msgs/String.h>
Go to the source code of this file.
Classes | |
class | place_matcher_mcc::DissimilarityGetter |
Namespaces | |
namespace | place_matcher_mcc |
Typedefs | |
typedef boost::numeric::ublas::matrix < double > | place_matcher_mcc::matrix |
typedef std::vector < geometry_msgs::Polygon > | place_matcher_mcc::polygon_list |