Public Member Functions | Protected Member Functions | Protected Attributes
MotorsMonitor Class Reference

#include <motors_monitor.h>

List of all members.

Public Member Functions

 MotorsMonitor (ros::NodeHandle *nh)
bool ok ()

Protected Member Functions

int lookForSeriousFault (uint8_t, const int)
void motor_feedback (const roboteq_msgs::FeedbackConstPtr, const int)
void motor_status (const roboteq_msgs::StatusConstPtr &, const int)
void msg_watchdog (const ros::TimerEvent &)

Protected Attributes

ros::Publisher estop_pub_
int fault_level_ [4]
ros::Subscriber fb_sub_ [4]
roboteq_msgs::FeedbackConstPtr last_received_feedback_ [4]
roboteq_msgs::StatusConstPtr last_received_status_ [4]
ros::Duration motors_timeout_
ros::NodeHandle nh_
ros::Subscriber stat_sub_ [4]

Detailed Description

Definition at line 11 of file motors_monitor.h.


Constructor & Destructor Documentation

Definition at line 33 of file motors_monitor.cpp.


Member Function Documentation

int MotorsMonitor::lookForSeriousFault ( uint8_t  fault_code,
const int  motor_num 
) [protected]

Definition at line 90 of file motors_monitor.cpp.

void MotorsMonitor::motor_feedback ( const roboteq_msgs::FeedbackConstPtr  msg,
const int  motor_num 
) [protected]

Definition at line 131 of file motors_monitor.cpp.

void MotorsMonitor::motor_status ( const roboteq_msgs::StatusConstPtr &  msg,
const int  motor_num 
) [protected]

Definition at line 135 of file motors_monitor.cpp.

void MotorsMonitor::msg_watchdog ( const ros::TimerEvent ) [protected]

Called in the context of whether cmd_vels may be passed through as safe.

Definition at line 64 of file motors_monitor.cpp.


Member Data Documentation

Definition at line 29 of file motors_monitor.h.

int MotorsMonitor::fault_level_[4] [protected]

Definition at line 26 of file motors_monitor.h.

Definition at line 28 of file motors_monitor.h.

roboteq_msgs::FeedbackConstPtr MotorsMonitor::last_received_feedback_[4] [protected]

Definition at line 32 of file motors_monitor.h.

roboteq_msgs::StatusConstPtr MotorsMonitor::last_received_status_[4] [protected]

Definition at line 31 of file motors_monitor.h.

Definition at line 30 of file motors_monitor.h.

Definition at line 18 of file motors_monitor.h.

Definition at line 28 of file motors_monitor.h.


The documentation for this class was generated from the following files:


grizzly_motion
Author(s):
autogenerated on Fri Aug 28 2015 10:55:30