#include <pluginlib/class_list_macros.h>
#include <rsm_core/BaseState.h>
#include <rsm_core/IdleState.h>
#include <rsm_core/EmergencyStopState.h>
#include <rsm_core/TeleoperationState.h>
#include <rsm_core/StateInterface.h>
#include <geometry_msgs/PoseArray.h>
#include <rsm_msgs/SetNavigationGoal.h>
#include <rsm_msgs/GetRobotPose.h>
#include <tf/transform_listener.h>
Go to the source code of this file.
|
class | rsm::CalculateGoalState |
| State for choosing a goal from all provided frontiers and calling Navigation when successful. The frontier center closest to the robot is selected as navigation goal. More...
|
|