#include <gtest/gtest.h>
#include <ros/service.h>
#include <ros/ros.h>
#include <nav_msgs/GetMap.h>
#include <nav_msgs/OccupancyGrid.h>
#include <nav_msgs/MapMetaData.h>
Go to the source code of this file.
Classes | |
class | MapClientTest |
Functions | |
int | main (int argc, char **argv) |
TEST_F (MapClientTest, subscribe_topic_metadata) | |
TEST_F (MapClientTest, subscribe_topic) | |
TEST_F (MapClientTest, call_service) | |
Variables | |
double | g_height |
double | g_max_free_ratio |
double | g_min_free_ratio |
ros::NodeHandle * | g_n = NULL |
double | g_res |
double | g_width |
TEST_F | ( | MapClientTest | , | |
subscribe_topic_metadata | ||||
) |
TEST_F | ( | MapClientTest | , | |
subscribe_topic | ||||
) |
TEST_F | ( | MapClientTest | , | |
call_service | ||||
) |
double g_max_free_ratio |
double g_min_free_ratio |