rostate_machine.h
Go to the documentation of this file.
1 #ifndef ROSTATE_MACHINE_H_INCLUDED
2 #define ROSTATE_MACHINE_H_INCLUDED
3 
15 //headers in this package
16 #include "state_machine.h"
17 #include <rostate_machine/State.h>
18 #include <rostate_machine/Event.h>
19 
20 //headers in STL
21 #include <memory>
22 #include <sstream>
23 
24 //headers in ROS
25 #include <ros/ros.h>
26 #include <std_msgs/String.h>
27 
28 //headers in Boost
29 #include <boost/thread.hpp>
30 #include <boost/bind.hpp>
31 #include <boost/circular_buffer.hpp>
32 
38 {
39 public:
42  void run();
43 private:
44  void publishCurrentState();
46  std::shared_ptr<StateMachine> state_machine_ptr_;
47  boost::circular_buffer<std::string> state_buf_;
53  std::string state_machine_name_;
54  std::string description_;
55  std::string dot_filepath_;
56  double publish_rate_;
57 };
58 
59 #endif //ROSTATE_MACHINE_H_INCLUDED
void run()
Run State Machine (Enable Transitions)
std::string description_
void eventCallback(const ros::MessageEvent< rostate_machine::Event const > &event)
Callback Function for Trigger Event Topic.
ros::NodeHandle pnh_
void publishCurrentState()
Publish Current State Topic.
boost::circular_buffer< std::string > state_buf_
ros::NodeHandle nh_
~RostateMachine()
Destroy the Rostate Machine:: Rostate Machine object.
std::shared_ptr< StateMachine > state_machine_ptr_
ros::Publisher dot_string_pub_
ros::Subscriber trigger_event_sub_
std::string state_machine_name_
ros::Publisher current_state_pub_
ROS wrapper of the State Machine Class.
std::string dot_filepath_
RostateMachine(ros::NodeHandle nh, ros::NodeHandle pnh)
Construct a new Rostate Machine:: Rostate Machine object.
State Machine Library using Boost::Graph.


rostate_machine
Author(s):
autogenerated on Wed Sep 4 2019 05:19:52