#include <cmath>
#include <cstddef>
#include <string>
#include <unistd.h>
#include <vector>
#include <ros/ros.h>
#include <costmap_cspace_msgs/CSpace3D.h>
#include <nav_msgs/GetPlan.h>
#include <nav_msgs/OccupancyGrid.h>
#include <nav_msgs/Path.h>
#include <planner_cspace_msgs/PlannerStatus.h>
#include <std_srvs/Empty.h>
#include <tf2/utils.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <tf2_ros/transform_listener.h>
#include <gtest/gtest.h>
Go to the source code of this file.
◆ main()
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
◆ TEST_F() [1/4]
◆ TEST_F() [2/4]
TEST_F |
( |
Navigate |
, |
|
|
NavigateWithLocalMap |
|
|
) |
| |
◆ TEST_F() [3/4]
◆ TEST_F() [4/4]
TEST_F |
( |
Navigate |
, |
|
|
RobotIsInRockOnSetGoal |
|
|
) |
| |