Go to the source code of this file.
|
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) |
|
| TEST (MergingPipeline, oneEmptyImage) |
|
| TEST (MergingPipeline, knownInitPositions) |
|
◆ EXPECT_VALID_GRID
#define EXPECT_VALID_GRID |
( |
|
grid | ) |
|
Value:ASSERT_TRUE(static_cast<bool>(grid)); \
EXPECT_GT(grid->info.resolution, 0); \
EXPECT_TRUE(
isIdentity(grid->info.origin.orientation))
static bool isIdentity(const cv::Mat &matrix)
static bool consistentData(const nav_msgs::OccupancyGrid &grid)
Definition at line 59 of file test_merging_pipeline.cpp.
◆ private
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ TEST() [1/12]
TEST |
( |
MergingPipeline |
, |
|
|
canStich0Grid |
|
|
) |
| |
◆ TEST() [2/12]
TEST |
( |
MergingPipeline |
, |
|
|
canStich1Grid |
|
|
) |
| |
◆ TEST() [3/12]
TEST |
( |
MergingPipeline |
, |
|
|
canStich2Grids |
|
|
) |
| |
◆ TEST() [4/12]
TEST |
( |
MergingPipeline |
, |
|
|
canStichGridsGmapping |
|
|
) |
| |
◆ TEST() [5/12]
TEST |
( |
MergingPipeline |
, |
|
|
estimationAccuracy |
|
|
) |
| |
◆ TEST() [6/12]
TEST |
( |
MergingPipeline |
, |
|
|
transformsRoundTrip |
|
|
) |
| |
◆ TEST() [7/12]
TEST |
( |
MergingPipeline |
, |
|
|
setTransformsInternal |
|
|
) |
| |
◆ TEST() [8/12]
TEST |
( |
MergingPipeline |
, |
|
|
getTransformsInternal |
|
|
) |
| |
◆ TEST() [9/12]
TEST |
( |
MergingPipeline |
, |
|
|
setEmptyTransforms |
|
|
) |
| |
◆ TEST() [10/12]
TEST |
( |
MergingPipeline |
, |
|
|
emptyImageWithTransform |
|
|
) |
| |
◆ TEST() [11/12]
TEST |
( |
MergingPipeline |
, |
|
|
oneEmptyImage |
|
|
) |
| |
◆ TEST() [12/12]
TEST |
( |
MergingPipeline |
, |
|
|
knownInitPositions |
|
|
) |
| |
◆ gmapping_maps
const std::array<const char*, 2> gmapping_maps |
◆ hector_maps
const std::array<const char*, 2> hector_maps |
◆ verbose_tests
constexpr bool verbose_tests = false |