#include <string>#include <ros/ros.h>#include <std_msgs/Int32.h>#include <map_organizer_msgs/OccupancyGridArray.h>#include <nav_msgs/OccupancyGrid.h>#include <gtest/gtest.h>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| TEST (MapOrganizer, MapArray) | |
| TEST (MapOrganizer, Maps) | |
| TEST (MapOrganizer, SelectMap) | |
| TEST (MapOrganizer, SavedMapArray) | |
| void | validateMap0 (const nav_msgs::OccupancyGrid &map, const double z) |
| void | validateMap1 (const nav_msgs::OccupancyGrid &map, const double z) |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 225 of file test_map_organizer.cpp.
| TEST | ( | MapOrganizer | , |
| MapArray | |||
| ) |
Definition at line 76 of file test_map_organizer.cpp.
| TEST | ( | MapOrganizer | , |
| Maps | |||
| ) |
Definition at line 103 of file test_map_organizer.cpp.
| TEST | ( | MapOrganizer | , |
| SelectMap | |||
| ) |
Definition at line 135 of file test_map_organizer.cpp.
| TEST | ( | MapOrganizer | , |
| SavedMapArray | |||
| ) |
Definition at line 190 of file test_map_organizer.cpp.
| void validateMap0 | ( | const nav_msgs::OccupancyGrid & | map, |
| const double | z | ||
| ) |
Definition at line 39 of file test_map_organizer.cpp.
| void validateMap1 | ( | const nav_msgs::OccupancyGrid & | map, |
| const double | z | ||
| ) |
Definition at line 57 of file test_map_organizer.cpp.