#include <algorithm>
#include <cmath>
#include <cstddef>
#include <string>
#include <vector>
#include <ros/ros.h>
#include <costmap_cspace/costmap_3d.h>
#include <nav_msgs/OccupancyGrid.h>
#include <gtest/gtest.h>
Go to the source code of this file.
|
const std::string | footprint_str ("<value><array><data>"" <value><array><data>"" <value><double>1.5</double></value>"" <value><double>0.0</double></value>"" </data></array></value>"" <value><array><data>"" <value><double>-0.5</double></value>"" <value><double>-0.5</double></value>"" </data></array></value>"" <value><array><data>"" <value><double>-0.5</double></value>"" <value><double>0.5</double></value>"" </data></array></value>""</data></array></value>") |
|
int | main (int argc, char **argv) |
|
| TEST (Costmap3dLayerFootprint, CSpaceTemplate) |
|
| TEST (Costmap3dLayerPlain, CSpaceTemplate) |
|
| TEST (Costmap3dLayerFootprint, CSpaceGenerate) |
|
| TEST (Costmap3dLayerFootprint, CSpaceExpandSpread) |
|
| TEST (Costmap3dLayerFootprint, CSpaceOverwrite) |
|
| TEST (Costmap3dLayerFootprint, CSpaceOverlayMove) |
|
| TEST (Costmap3dLayerOutput, CSpaceOutOfBoundary) |
|
| TEST (Costmap3dLayerFootprint, CSpaceKeepUnknown) |
|
| TEST (Costmap3dLayerFootprint, Costmap3dLayerPlain) |
|
const std::string footprint_str |
( |
"<value><array><data>"" <value><array><data>"" <value><double>1.5</double></value>"" <value><double>0.0</double></value>"" </data></array></value>"" <value><array><data>"" <value><double>-0.5</double></value>"" <value><double>-0.5</double></value>"" </data></array></value>"" <value><array><data>"" <value><double>-0.5</double></value>"" <value><double>0.5</double></value>"" </data></array></value>""</data></array></value>" |
| ) |
|
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
TEST |
( |
Costmap3dLayerFootprint |
, |
|
|
CSpaceTemplate |
|
|
) |
| |
TEST |
( |
Costmap3dLayerPlain |
, |
|
|
CSpaceTemplate |
|
|
) |
| |
TEST |
( |
Costmap3dLayerFootprint |
, |
|
|
CSpaceGenerate |
|
|
) |
| |
TEST |
( |
Costmap3dLayerFootprint |
, |
|
|
CSpaceExpandSpread |
|
|
) |
| |
TEST |
( |
Costmap3dLayerFootprint |
, |
|
|
CSpaceOverwrite |
|
|
) |
| |
TEST |
( |
Costmap3dLayerFootprint |
, |
|
|
CSpaceOverlayMove |
|
|
) |
| |
TEST |
( |
Costmap3dLayerOutput |
, |
|
|
CSpaceOutOfBoundary |
|
|
) |
| |
TEST |
( |
Costmap3dLayerFootprint |
, |
|
|
CSpaceKeepUnknown |
|
|
) |
| |
TEST |
( |
Costmap3dLayerFootprint |
, |
|
|
Costmap3dLayerPlain |
|
|
) |
| |
const char temp_dir[4][2] |