#include "grid_map_core/GridMap.hpp"#include "grid_map_core/iterators/GridMapIterator.hpp"#include "grid_map_core/gtest_eigen.hpp"#include "grid_map_ros/GridMapRosConverter.hpp"#include "grid_map_msgs/GridMap.h"#include <gtest/gtest.h>#include <Eigen/Core>#include <string>#include <vector>#include <stdlib.h>#include <iterator>#include <nav_msgs/OccupancyGrid.h>#include <cv_bridge/cv_bridge.h>#include <sensor_msgs/image_encodings.h>
Go to the source code of this file.
Functions | |
| TEST (RosMessageConversion, roundTrip) | |
| TEST (RosbagHandling, saveLoad) | |
| TEST (RosbagHandling, saveLoadWithTime) | |
| TEST (OccupancyGridConversion, withMove) | |
| TEST (OccupancyGridConversion, roundTrip) | |
| TEST (ImageConversion, roundTripBGRA8) | |
| TEST (ImageConversion, roundTripMONO16) | |
| TEST | ( | RosMessageConversion | , |
| roundTrip | |||
| ) |
Definition at line 35 of file GridMapRosTest.cpp.
| TEST | ( | RosbagHandling | , |
| saveLoad | |||
| ) |
Definition at line 58 of file GridMapRosTest.cpp.
| TEST | ( | RosbagHandling | , |
| saveLoadWithTime | |||
| ) |
Definition at line 85 of file GridMapRosTest.cpp.
| TEST | ( | OccupancyGridConversion | , |
| withMove | |||
| ) |
Definition at line 116 of file GridMapRosTest.cpp.
| TEST | ( | OccupancyGridConversion | , |
| roundTrip | |||
| ) |
Definition at line 140 of file GridMapRosTest.cpp.
| TEST | ( | ImageConversion | , |
| roundTripBGRA8 | |||
| ) |
Definition at line 186 of file GridMapRosTest.cpp.
| TEST | ( | ImageConversion | , |
| roundTripMONO16 | |||
| ) |
Definition at line 212 of file GridMapRosTest.cpp.