#include <boost/statechart/event.hpp>#include <boost/statechart/state_machine.hpp>#include <boost/statechart/simple_state.hpp>#include <boost/statechart/state.hpp>#include <boost/statechart/transition.hpp>#include <boost/statechart/custom_reaction.hpp>#include <Utils.h>#include <std_msgs/Int16.h>

Go to the source code of this file.
| Classes | |
| class | AlignState | 
| class | ErrorState | 
| class | FilterState | 
| class | FODDetectionState | 
| class | GICPState | 
| class | IdleState | 
| class | NoValidEvent | 
| class | PublishEvent | 
| class | PublishState | 
| class | StartEvent | 
| class | StateMachine | 
| class | StopPublishEvent | 
| class | ValidEvent | 
| class | ValidFODEvent | 
| Macros | |
| #define | _LEICA_STATE_MACHINE_H | 
| Typedefs | |
| typedef pcl::PointCloud< pcl::PointXYZRGB > | PointCloudRGB | 
| typedef pcl::PointCloud< pcl::PointXYZ > | PointCloudXYZ | 
| #define _LEICA_STATE_MACHINE_H | 
Definition at line 20 of file LeicaStateMachine.h.
| typedef pcl::PointCloud<pcl::PointXYZRGB> PointCloudRGB | 
Definition at line 34 of file LeicaStateMachine.h.
| typedef pcl::PointCloud<pcl::PointXYZ> PointCloudXYZ | 
Definition at line 33 of file LeicaStateMachine.h.