Public Member Functions | Public Attributes | List of all members
StateMachine Class Reference

#include <LeicaStateMachine.h>

Inheritance diagram for StateMachine:
Inheritance graph
[legend]

Public Member Functions

Eigen::Matrix4f getCloudTransform ()
 
std::vector< PointCloudRGB::Ptr > getFODCloudArray ()
 
int getNFODs ()
 
PointCloudRGB::Ptr getSourceCloud ()
 
PointCloudRGB::Ptr getSourceCloudFiltered ()
 
PointCloudRGB::Ptr getTargetCloud ()
 
PointCloudRGB::Ptr getTargetCloudFiltered ()
 
void setCloudTransform (Eigen::Matrix4f tf)
 
void setSourceCloudFiltered (PointCloudRGB::Ptr cloud_ptr)
 
void setTargetCloudFiltered (PointCloudRGB::Ptr cloud_ptr)
 
 StateMachine (PointCloudRGB::Ptr source_cloud, PointCloudRGB::Ptr target_cloud, ros::NodeHandle nh)
 
void storeFODInfo (const ValidFODEvent &fod_info)
 
void updateCloud (const ValidEvent &cloud)
 
void updateClouds (const ValidEvent &clouds)
 

Public Attributes

Eigen::Matrix4f cloud_transform_
 
std::vector< PointCloudRGB::Ptr > fods_cloud_array_
 
ros::Publisher fods_pub_
 
int n_fod_
 
ros::Publisher n_fods_pub_
 
ros::NodeHandle nh_
 
PointCloudRGB::Ptr source_cloud_
 
PointCloudRGB::Ptr source_cloud_filtered_
 
ros::Publisher source_pub_
 
PointCloudRGB::Ptr target_cloud_
 
PointCloudRGB::Ptr target_cloud_filtered_
 
ros::Publisher target_pub_
 

Detailed Description

Definition at line 76 of file LeicaStateMachine.h.

Constructor & Destructor Documentation

StateMachine::StateMachine ( PointCloudRGB::Ptr  source_cloud,
PointCloudRGB::Ptr  target_cloud,
ros::NodeHandle  nh 
)

Definition at line 27 of file LeicaStateMachine.cpp.

Member Function Documentation

Eigen::Matrix4f StateMachine::getCloudTransform ( )
inline

Definition at line 144 of file LeicaStateMachine.h.

std::vector<PointCloudRGB::Ptr> StateMachine::getFODCloudArray ( )
inline

Definition at line 159 of file LeicaStateMachine.h.

int StateMachine::getNFODs ( )
inline

Definition at line 154 of file LeicaStateMachine.h.

PointCloudRGB::Ptr StateMachine::getSourceCloud ( )
inline

Definition at line 121 of file LeicaStateMachine.h.

PointCloudRGB::Ptr StateMachine::getSourceCloudFiltered ( )
inline

Definition at line 126 of file LeicaStateMachine.h.

PointCloudRGB::Ptr StateMachine::getTargetCloud ( )
inline

Definition at line 117 of file LeicaStateMachine.h.

PointCloudRGB::Ptr StateMachine::getTargetCloudFiltered ( )
inline

Definition at line 130 of file LeicaStateMachine.h.

void StateMachine::setCloudTransform ( Eigen::Matrix4f  tf)
inline

Definition at line 149 of file LeicaStateMachine.h.

void StateMachine::setSourceCloudFiltered ( PointCloudRGB::Ptr  cloud_ptr)
inline

Definition at line 135 of file LeicaStateMachine.h.

void StateMachine::setTargetCloudFiltered ( PointCloudRGB::Ptr  cloud_ptr)
inline

Definition at line 139 of file LeicaStateMachine.h.

void StateMachine::storeFODInfo ( const ValidFODEvent fod_info)
inline

Definition at line 110 of file LeicaStateMachine.h.

void StateMachine::updateCloud ( const ValidEvent cloud)
inline

Definition at line 97 of file LeicaStateMachine.h.

void StateMachine::updateClouds ( const ValidEvent clouds)
inline

Definition at line 103 of file LeicaStateMachine.h.

Member Data Documentation

Eigen::Matrix4f StateMachine::cloud_transform_

Definition at line 86 of file LeicaStateMachine.h.

std::vector<PointCloudRGB::Ptr> StateMachine::fods_cloud_array_

Definition at line 89 of file LeicaStateMachine.h.

ros::Publisher StateMachine::fods_pub_

Definition at line 95 of file LeicaStateMachine.h.

int StateMachine::n_fod_

Definition at line 88 of file LeicaStateMachine.h.

ros::Publisher StateMachine::n_fods_pub_

Definition at line 94 of file LeicaStateMachine.h.

ros::NodeHandle StateMachine::nh_

Definition at line 91 of file LeicaStateMachine.h.

PointCloudRGB::Ptr StateMachine::source_cloud_

Definition at line 82 of file LeicaStateMachine.h.

PointCloudRGB::Ptr StateMachine::source_cloud_filtered_

Definition at line 84 of file LeicaStateMachine.h.

ros::Publisher StateMachine::source_pub_

Definition at line 92 of file LeicaStateMachine.h.

PointCloudRGB::Ptr StateMachine::target_cloud_

Definition at line 83 of file LeicaStateMachine.h.

PointCloudRGB::Ptr StateMachine::target_cloud_filtered_

Definition at line 85 of file LeicaStateMachine.h.

ros::Publisher StateMachine::target_pub_

Definition at line 93 of file LeicaStateMachine.h.


The documentation for this class was generated from the following files:


leica_point_cloud_processing
Author(s): Ines Lara Sicilia
autogenerated on Fri Feb 5 2021 03:20:30