ROS Wrapper for the State Machine Class. More...
#include "state_machine.h"
#include <rostate_machine/State.h>
#include <rostate_machine/Event.h>
#include <memory>
#include <sstream>
#include <ros/ros.h>
#include <std_msgs/String.h>
#include <boost/thread.hpp>
#include <boost/bind.hpp>
#include <boost/circular_buffer.hpp>
Go to the source code of this file.
Classes | |
class | RostateMachine |
ROS wrapper of the State Machine Class. More... | |
ROS Wrapper for the State Machine Class.
Definition in file rostate_machine.h.