Macros | Functions | Variables
test_merging_pipeline.cpp File Reference
#include <combine_grids/grid_warper.h>
#include <gtest/gtest.h>
#include <ros/console.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <opencv2/core/utility.hpp>
#include "testing_helpers.h"
#include <combine_grids/merging_pipeline.h>
Include dependency graph for test_merging_pipeline.cpp:

Go to the source code of this file.

Macros

#define private   public
 

Functions

int main (int argc, char **argv)
 
 TEST (MergingPipeline, canStich0Grid)
 
 TEST (MergingPipeline, canStich1Grid)
 
 TEST (MergingPipeline, canStich2Grids)
 
 TEST (MergingPipeline, canStichGridsGmapping)
 
 TEST (MergingPipeline, estimationAccuracy)
 
 TEST (MergingPipeline, transformsRoundTrip)
 
 TEST (MergingPipeline, setTransformsInternal)
 
 TEST (MergingPipeline, getTransformsInternal)
 
 TEST (MergingPipeline, setEmptyTransforms)
 
 TEST (MergingPipeline, emptyImageWithTransform)
 

Variables

const std::array< const char *, 2 > gmapping_maps
 
const std::array< const char *, 2 > hector_maps
 
constexpr bool verbose_tests = false
 

Macro Definition Documentation

#define private   public

Definition at line 44 of file test_merging_pipeline.cpp.

Function Documentation

int main ( int  argc,
char **  argv 
)

Definition at line 300 of file test_merging_pipeline.cpp.

TEST ( MergingPipeline  ,
canStich0Grid   
)

Definition at line 57 of file test_merging_pipeline.cpp.

TEST ( MergingPipeline  ,
canStich1Grid   
)

Definition at line 67 of file test_merging_pipeline.cpp.

TEST ( MergingPipeline  ,
canStich2Grids   
)

Definition at line 95 of file test_merging_pipeline.cpp.

TEST ( MergingPipeline  ,
canStichGridsGmapping   
)

Definition at line 117 of file test_merging_pipeline.cpp.

TEST ( MergingPipeline  ,
estimationAccuracy   
)

Definition at line 139 of file test_merging_pipeline.cpp.

TEST ( MergingPipeline  ,
transformsRoundTrip   
)

Definition at line 185 of file test_merging_pipeline.cpp.

TEST ( MergingPipeline  ,
setTransformsInternal   
)

Definition at line 216 of file test_merging_pipeline.cpp.

TEST ( MergingPipeline  ,
getTransformsInternal   
)

Definition at line 243 of file test_merging_pipeline.cpp.

TEST ( MergingPipeline  ,
setEmptyTransforms   
)

Definition at line 274 of file test_merging_pipeline.cpp.

TEST ( MergingPipeline  ,
emptyImageWithTransform   
)

Definition at line 287 of file test_merging_pipeline.cpp.

Variable Documentation

const std::array<const char*, 2> gmapping_maps
Initial value:
= {
"2011-08-09-12-22-52.pgm", "2012-01-28-11-12-01.pgm",
}

Definition at line 51 of file test_merging_pipeline.cpp.

const std::array<const char*, 2> hector_maps
Initial value:
= {
"map00.pgm", "map05.pgm",
}

Definition at line 47 of file test_merging_pipeline.cpp.

constexpr bool verbose_tests = false

Definition at line 55 of file test_merging_pipeline.cpp.



map_merge
Author(s): Jiri Horner
autogenerated on Mon Jun 10 2019 13:56:52