#include <algorithm>
#include <cmath>
#include <cstdlib>
#include <ctime>
#include <fstream>
#include <vector>
#include <geometry_msgs/Point32.h>
#include <geometry_msgs/Polygon.h>
#include <geometry_msgs/Pose.h>
#include <gtest/gtest.h>
#include <place_matcher_msgs/PolygonDissimilarity.h>
#include <ros/ros.h>
#include <tf/tf.h>
#include <place_matcher_csm/dissimilarity_getter.h>
Go to the source code of this file.
Define Documentation
Function Documentation
std::vector<geometry_msgs::Point32> interpolate |
( |
const geometry_msgs::Point32 & |
a, |
|
|
const geometry_msgs::Point32 |
b, |
|
|
double |
max_distance |
|
) |
| |
int main |
( |
int |
argc, |
|
|
char * |
argv[] |
|
) |
| |
geometry_msgs::Point32 point |
( |
double |
x, |
|
|
double |
y |
|
) |
| |
TEST |
( |
TestSuite |
, |
|
|
testGetDissimilarity |
|
|
) |
| |
Variable Documentation