Functions
utest.cpp File Reference
#include <cmath>
#include <limits>
#include <fstream>
#include <iostream>
#include <sstream>
#include <stdexcept>
#include <vector>
#include <gtest/gtest.h>
#include <rosbag/bag.h>
#include <angles/angles.h>
#include <geometry_msgs/Point32.h>
#include <sensor_msgs/LaserScan.h>
#include <lama_common/place_profile_conversions.h>
#include <crossing_detector/laser_crossing_detector.h>
Include dependency graph for utest.cpp:

Go to the source code of this file.

Functions

std::vector
< geometry_msgs::Point32 > 
interpolate (const geometry_msgs::Point32 &a, const geometry_msgs::Point32 b, double max_distance)
PlaceProfile loadFromString (std::stringstream &sstream)
int main (int argc, char **argv)
geometry_msgs::Point32 point (double x, double y)
PlaceProfile profileFrontierAngle (double angle, double &frontier_angle)
void saveToFile (const std::string &filename, const PlaceProfile &profile)
void saveToFile (const std::string &filename, const lama_msgs::Crossing &crossing)
 TEST (TestSuite, TestCrossingDescriptor)
 TEST (TestSuite, TestFrontierAngle)

Function Documentation

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

Definition at line 97 of file utest.cpp.

PlaceProfile loadFromString ( std::stringstream &  sstream)

Definition at line 20 of file utest.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 617 of file utest.cpp.

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

Definition at line 89 of file utest.cpp.

PlaceProfile profileFrontierAngle ( double  angle,
double &  frontier_angle 
)

Profile: P3 ++++++++++++++++++++++ P2 + + P1 ++++++++++ P0 + + P4 ++++++++++++++++++++++++++++ P5

with distance(P1, P2) = 1 and angle(P0, P1, P2) = angle.

Parameters:
[out]frontier_angle,theexpected frontier angle with the line going from the robot to the frontier center.

Definition at line 136 of file utest.cpp.

void saveToFile ( const std::string &  filename,
const PlaceProfile &  profile 
)

Definition at line 64 of file utest.cpp.

void saveToFile ( const std::string &  filename,
const lama_msgs::Crossing &  crossing 
)

Definition at line 79 of file utest.cpp.

TEST ( TestSuite  ,
TestCrossingDescriptor   
)

Definition at line 183 of file utest.cpp.

TEST ( TestSuite  ,
TestFrontierAngle   
)

Definition at line 559 of file utest.cpp.



crossing_detector
Author(s): Gaël Ecorchard , Karel Košnar , Vojtěch Vonásek
autogenerated on Thu Jun 6 2019 22:02:06