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 |
This class implements the detection of a bed given an odometry.
Definition at line 34 of file bed_detection.h.
| BD::BedDetection | ( | const ros::NodeHandle & | node_handle, |
| const ros::NodeHandle & | private_node_handle | ||
| ) |
Class constructor
| node_handle | |
| private_node_handle |
Definition at line 17 of file bed_detection.cpp.
|
default |
Class destructor
| 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.
Definition at line 59 of file bed_detection.cpp.
|
private |
Definition at line 80 of file bed_detection.h.
|
private |
states if system is init
Definition at line 79 of file bed_detection.h.
|
private |
node handle
Definition at line 69 of file bed_detection.h.
|
private |
Definition at line 86 of file bed_detection.h.
|
private |
private node handle
Definition at line 70 of file bed_detection.h.
|
private |
Definition at line 76 of file bed_detection.h.
|
private |
Definition at line 73 of file bed_detection.h.
|
private |
Definition at line 81 of file bed_detection.h.
|
private |
Definition at line 82 of file bed_detection.h.
|
private |
Definition at line 83 of file bed_detection.h.