Defines | Functions | Variables
utest.cpp File Reference
#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>
Include dependency graph for utest.cpp:

Go to the source code of this file.

Defines

#define FILE_OUTPUT   0

Functions

geometry_msgs::Polygon getRandPolygon ()
geometry_msgs::Polygon getTestPolygon ()
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)
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   0

Definition at line 18 of file utest.cpp.


Function Documentation

geometry_msgs::Polygon getRandPolygon ( )

Definition at line 57 of file utest.cpp.

geometry_msgs::Polygon getTestPolygon ( )

Definition at line 121 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 77 of file utest.cpp.

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

Definition at line 204 of file utest.cpp.

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

Definition at line 104 of file utest.cpp.

TEST ( TestSuite  ,
testGetDissimilarity   
)

Definition at line 146 of file utest.cpp.

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

Definition at line 39 of file utest.cpp.

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

Definition at line 49 of file utest.cpp.


Variable Documentation

Definition at line 20 of file utest.cpp.



place_matcher_csm
Author(s): Gaƫl Ecorchard
autogenerated on Sat Jun 8 2019 19:52:59