#include <ros/ros.h>#include <actionlib/client/simple_action_client.h>#include <actionlib/server/simple_action_server.h>#include <carl_safety/Error.h>#include <geometry_msgs/Pose.h>#include <geometry_msgs/Twist.h>#include <move_base_msgs/MoveBaseAction.h>#include <sensor_msgs/JointState.h>#include <sensor_msgs/Joy.h>#include <std_srvs/Empty.h>#include <wpi_jaco_msgs/GetAngularPosition.h>#include <wpi_jaco_msgs/GetCartesianPosition.h>#include <wpi_jaco_msgs/HomeArmAction.h>

Go to the source code of this file.
Classes | |
| class | NavSafety |
| Prevents CARL from (manually) driving past a linear boundary on the map. More... | |
Defines | |
| #define | ANALOG 0 |
| Prevents CARL from (manually) driving past a linear boundary on the map. | |
| #define | BOUNDARY_X 4.4 |
| #define | BOUNDARY_Y 1.0 |
| #define | DIGITAL 1 |
| #define | PI 3.14159 |
| #define ANALOG 0 |
Prevents CARL from (manually) driving past a linear boundary on the map.
.h nav_safety creates a ROS node that prevents CARL from crossing a line on the map during manual navigation. The node also adds estop functionality that prevents only online manual navigation commands.
Definition at line 31 of file nav_safety.h.
| #define BOUNDARY_X 4.4 |
Definition at line 35 of file nav_safety.h.
| #define BOUNDARY_Y 1.0 |
Definition at line 36 of file nav_safety.h.
| #define DIGITAL 1 |
Definition at line 32 of file nav_safety.h.
| #define PI 3.14159 |
Definition at line 37 of file nav_safety.h.