#include <ros/ros.h>
#include <carl_safety/Error.h>
#include <sensor_msgs/JointState.h>
#include <std_srvs/Empty.h>
#include <wpi_jaco_msgs/EStop.h>
Go to the source code of this file.
Classes | |
class | TippingSafety |
Defines | |
#define | BASE_PITCH_THRESHOLD 0.08 |
Prevents CARL from tipping over. | |
#define | BASE_ROLL_THRESHOLD 0.035 |
#define BASE_PITCH_THRESHOLD 0.08 |
Prevents CARL from tipping over.
.h tipping_safety listens to the joint state information of the base and sends an estop command to the arm and to the nav_safety layer, preventing the robot from tipping over.
Definition at line 22 of file tipping_safety.h.
#define BASE_ROLL_THRESHOLD 0.035 |
Definition at line 23 of file tipping_safety.h.