#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>
#include "test_constants.h"
Go to the source code of this file.
Classes | |
class | MapClientTest |
Functions | |
int | main (int argc, char **argv) |
TEST_F (MapClientTest, call_service) | |
TEST_F (MapClientTest, subscribe_topic) | |
TEST_F (MapClientTest, subscribe_topic_metadata) | |
Variables | |
int | g_argc |
char ** | g_argv |
TEST_F | ( | MapClientTest | , |
call_service | |||
) |
TEST_F | ( | MapClientTest | , |
subscribe_topic | |||
) |
TEST_F | ( | MapClientTest | , |
subscribe_topic_metadata | |||
) |