#include <memory>
#include <string>
#include <gtest/gtest.h>
#include <ros/ros.h>
#include <actionlib/client/simple_action_client.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <nav_msgs/GetPlan.h>
#include <planner_cspace_msgs/PlannerStatus.h>
#include <tf2/utils.h>
#include <tf2_ros/transform_listener.h>
Go to the source code of this file.
◆ ACTION_TOPIC_MOVE_BASE
constexpr const char ACTION_TOPIC_MOVE_BASE[] = "/move_base" |
|
constexpr |
◆ ACTION_TOPIC_TOLERANT_MOVE
constexpr const char ACTION_TOPIC_TOLERANT_MOVE[] = "/tolerant_move" |
|
constexpr |