Public Member Functions | Private Attributes | List of all members
BedDetection Class Reference

This class implements the detection of a bed given an odometry. More...

#include <bed_detection.h>

Public Member Functions

 BedDetection (const ros::NodeHandle &node_handle, const ros::NodeHandle &private_node_handle)
 
void cb_is_straight (const nm::OdometryPtr &odom_sub)
 
void init ()
 
bool is_straight ()
 
bool is_straight_time ()
 
bool ok ()
 
 ~BedDetection ()=default
 

Private Attributes

bool _first_time
 
bool _is_init
 states if system is init More...
 
ros::NodeHandle _nh
 node handle More...
 
nm::Odometry _odom
 
ros::NodeHandle _pnh
 private node handle More...
 
ros::Publisher _pub_is_straight
 
ros::Subscriber _sub_odom
 
double _threshold_time
 
double _threshold_twist
 
ros::Time _tp_1
 

Detailed Description

This class implements the detection of a bed given an odometry.

Definition at line 34 of file bed_detection.h.

Constructor & Destructor Documentation

BD::BedDetection ( const ros::NodeHandle node_handle,
const ros::NodeHandle private_node_handle 
)

Class constructor

Parameters
node_handle
private_node_handle

Definition at line 17 of file bed_detection.cpp.

BedDetection::~BedDetection ( )
default

Class destructor

Member Function Documentation

void BD::cb_is_straight ( const nm::OdometryPtr &  odom_sub)

Definition at line 65 of file bed_detection.cpp.

void BD::init ( )

Initializes the ROS node (creates variables, publishers and subscriebrs).

Definition at line 25 of file bed_detection.cpp.

bool BD::is_straight ( )

Definition at line 81 of file bed_detection.cpp.

bool BD::is_straight_time ( )

Definition at line 96 of file bed_detection.cpp.

bool BD::ok ( )

Checks if the node is properly initialized.

Returns
'true' if the initialization is correct.

Definition at line 59 of file bed_detection.cpp.

Member Data Documentation

bool BedDetection::_first_time
private

Definition at line 80 of file bed_detection.h.

bool BedDetection::_is_init
private

states if system is init

Definition at line 79 of file bed_detection.h.

ros::NodeHandle BedDetection::_nh
private

node handle

Definition at line 69 of file bed_detection.h.

nm::Odometry BedDetection::_odom
private

Definition at line 86 of file bed_detection.h.

ros::NodeHandle BedDetection::_pnh
private

private node handle

Definition at line 70 of file bed_detection.h.

ros::Publisher BedDetection::_pub_is_straight
private

Definition at line 76 of file bed_detection.h.

ros::Subscriber BedDetection::_sub_odom
private

Definition at line 73 of file bed_detection.h.

double BedDetection::_threshold_time
private

Definition at line 81 of file bed_detection.h.

double BedDetection::_threshold_twist
private

Definition at line 82 of file bed_detection.h.

ros::Time BedDetection::_tp_1
private

Definition at line 83 of file bed_detection.h.


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


earth_rover_bed_detection
Author(s):
autogenerated on Wed Apr 28 2021 02:15:32