Classes | Typedefs | Functions
carl_estop_node.h File Reference
#include <ros/ros.h>
#include <std_msgs/Empty.h>
#include <actionlib/client/simple_action_client.h>
#include <move_base_msgs/MoveBaseAction.h>
#include <rmp_msgs/RMPCommand.h>
Include dependency graph for carl_estop_node.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  carl_estop

Typedefs

typedef
actionlib::SimpleActionClient
< move_base_msgs::MoveBaseAction > 
ActionClient

Functions

int main (int argc, char **argv)
 Allows for stopping of CARL.

Typedef Documentation

typedef actionlib::SimpleActionClient<move_base_msgs::MoveBaseAction> ActionClient

.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.

Author:
Russell Toris, WPI - russell.toris@gmail.com
Chris Dunkers, WPI - cmdunkers@wpi.edu
Date:
July 24, 2014

Definition at line 23 of file carl_estop_node.h.


Function Documentation

int main ( int  argc,
char **  argv 
)

Allows for stopping of CARL.

Creates and runs the carl_estop_node.

Parameters:
argcargument count that is passed to ros::init
argvarguments that are passed to ros::init
Returns:
EXIT_SUCCESS

.cpp pc_estop_node creates a ROS node that allows a user to stop CARL. and sends messages to the /carl_estop topic.

Author:
Russell Toris, WPI - russell.toris@gmail.com
Chris Dunkers, WPI - spkordell@wpi.edu
Date:
July 24, 2014

Creates and runs the carl_estop_node.

Parameters:
argcargument count that is passed to ros::init
argvarguments that are passed to ros::init
Returns:
EXIT_SUCCESS

Definition at line 73 of file carl_estop_node.cpp.



carl_estop
Author(s): Chris Dunkers
autogenerated on Tue Mar 8 2016 00:59:25