#include <ros/ros.h>
#include "grizzly_motion/change_limiter.h"
#include "diagnostic_updater/diagnostic_updater.h"
#include "diagnostic_updater/publisher.h"
Go to the source code of this file.
Classes | |
class | MotionSafety |
Namespaces | |
namespace | diagnostic_updater |
namespace | grizzly_msgs |
namespace | MotionStates |
namespace | std_msgs |
Typedefs | |
typedef ChangeLimiter < grizzly_msgs::Drive > | DriveChangeLimiter |
typedef MotionStates::MotionState | MotionState |
Enumerations | |
enum | MotionStates::MotionState { MotionStates::Stopped, MotionStates::Starting, MotionStates::Moving, MotionStates::PendingStopped, MotionStates::Fault } |
Functions | |
grizzly_msgs::ROS_DECLARE_MESSAGE (Drive) | |
grizzly_msgs::ROS_DECLARE_MESSAGE (RawStatus) | |
std_msgs::ROS_DECLARE_MESSAGE (Bool) |
typedef ChangeLimiter<grizzly_msgs::Drive> DriveChangeLimiter |
Definition at line 26 of file motion_safety.h.
typedef MotionStates::MotionState MotionState |
Definition at line 57 of file motion_safety.h.