#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 <rsm_msgs/GoalCompleted.h>
#include <sensor_msgs/JointState.h>
#include <std_msgs/Float64.h>
#include <std_srvs/Trigger.h>
Go to the source code of this file.
Classes | |
class | rsm::RealsenseMappingState |
Dummy state for mapping at a reached goal during exploration. Only initiates transition to CalculateGoalState. More... | |
Namespaces | |
rsm | |
Macros | |
#define | MOVE_LEFT 0 |
#define | MOVE_RIGHT 1 |
#define | MOVE_TO_CENTER 2 |
#define | POS_TOLERANCE 0.05 |
#define | REALSENSE_CENTER_POSITION 0.0 |
#define | REALSENSE_LEFT_LIMIT 1.30 |
#define | REALSENSE_RIGHT_LIMIT -1.30 |
#define MOVE_LEFT 0 |
Definition at line 15 of file RealsenseMappingState.h.
#define MOVE_RIGHT 1 |
Definition at line 16 of file RealsenseMappingState.h.
#define MOVE_TO_CENTER 2 |
Definition at line 17 of file RealsenseMappingState.h.
#define POS_TOLERANCE 0.05 |
Definition at line 23 of file RealsenseMappingState.h.
#define REALSENSE_CENTER_POSITION 0.0 |
Definition at line 21 of file RealsenseMappingState.h.
#define REALSENSE_LEFT_LIMIT 1.30 |
Definition at line 19 of file RealsenseMappingState.h.
#define REALSENSE_RIGHT_LIMIT -1.30 |
Definition at line 20 of file RealsenseMappingState.h.