Defines | Functions | Variables
utest.cpp File Reference
#include <algorithm>
#include <cmath>
#include <cstdlib>
#include <ctime>
#include <fstream>
#include <sstream>
#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_hist/dissimilarity_getter.h>
Include dependency graph for utest.cpp:

Go to the source code of this file.

Defines

#define FILE_OUTPUT   1

Functions

geometry_msgs::Polygon getRandPolygon ()
geometry_msgs::Polygon getRealPolygon ()
geometry_msgs::Polygon getTestPolygon ()
std::vector
< geometry_msgs::Point32 > 
interpolate (const geometry_msgs::Point32 &a, const geometry_msgs::Point32 b, double max_distance)
geometry_msgs::Polygon loadFromString (std::stringstream &sstream)
int main (int argc, char *argv[])
geometry_msgs::Point32 point (double x, double y)
void saveToFile (const std::string &filename, const geometry_msgs::Polygon &poly)
 TEST (TestSuite, testGetDissimilarity)
void transformPoint (const geometry_msgs::Pose &transform, geometry_msgs::Point32 &point)
void transformPolygon (const geometry_msgs::Pose &transform, geometry_msgs::Polygon &poly)

Variables

ros::NodeHandlePtr g_nh_ptr

Define Documentation

#define FILE_OUTPUT   1

Definition at line 19 of file utest.cpp.


Function Documentation

geometry_msgs::Polygon getRandPolygon ( )

Definition at line 58 of file utest.cpp.

geometry_msgs::Polygon getRealPolygon ( )

Data from CTU, IMR internal dataset "real-2sicks-karlovo-nam-e" file wca-2.txt. The last 2 points are excluded because they cause a non-simple polygon.

Definition at line 170 of file utest.cpp.

geometry_msgs::Polygon getTestPolygon ( )

Definition at line 140 of file utest.cpp.

std::vector<geometry_msgs::Point32> interpolate ( const geometry_msgs::Point32 &  a,
const geometry_msgs::Point32  b,
double  max_distance 
)

Definition at line 78 of file utest.cpp.

geometry_msgs::Polygon loadFromString ( std::stringstream &  sstream)

Definition at line 113 of file utest.cpp.

int main ( int  argc,
char *  argv[] 
)

Definition at line 572 of file utest.cpp.

geometry_msgs::Point32 point ( double  x,
double  y 
)

Definition at line 105 of file utest.cpp.

void saveToFile ( const std::string &  filename,
const geometry_msgs::Polygon &  poly 
)

Definition at line 24 of file utest.cpp.

TEST ( TestSuite  ,
testGetDissimilarity   
)

Definition at line 539 of file utest.cpp.

void transformPoint ( const geometry_msgs::Pose transform,
geometry_msgs::Point32 &  point 
)

Definition at line 40 of file utest.cpp.

void transformPolygon ( const geometry_msgs::Pose transform,
geometry_msgs::Polygon &  poly 
)

Definition at line 50 of file utest.cpp.


Variable Documentation

Definition at line 21 of file utest.cpp.



place_matcher_hist
Author(s):
autogenerated on Sat Jun 8 2019 19:53:03