#include <back_joints_node.h>
Public Member Functions | |
back_joints () | |
void | joints (const dynamixel_msgs::MotorStateList::ConstPtr &state) |
Private Attributes | |
ros::Subscriber | asus_sub |
std::map< int, std::string > | back_servos |
ros::Publisher | joint_states_pub |
ros::NodeHandle | node |
.h Allows the stopping of the segway base without losing power to peripherals.
carl_estop_node creates a ROS node that allows the stopping of the robot after a specified amount of time. This node listens to a /carl_estop topic and sends messages to the /move_base actionlib to stop the current execution of a goal.
Definition at line 23 of file back_joints_node.h.
Definition at line 4 of file back_joint_node.cpp.
void back_joints::joints | ( | const dynamixel_msgs::MotorStateList::ConstPtr & | state | ) |
estop function to check the time difference to see if any goal position in move_base should be cancelled.
msg | the empty message |
Definition at line 31 of file back_joint_node.cpp.
ros::Subscriber back_joints::asus_sub [private] |
Definition at line 39 of file back_joints_node.h.
std::map<int, std::string> back_joints::back_servos [private] |
Definition at line 43 of file back_joints_node.h.
ros::Publisher back_joints::joint_states_pub [private] |
Definition at line 40 of file back_joints_node.h.
ros::NodeHandle back_joints::node [private] |
Definition at line 36 of file back_joints_node.h.