#include <face_detector_node.h>
Public Member Functions | |
FaceDetectorNode (ros::NodeHandle nh) | |
~FaceDetectorNode (void) | |
Destructor. | |
Protected Member Functions | |
void | head_positions_callback (const cob_perception_msgs::ColorDepthImageArray::ConstPtr &head_positions) |
Callback for incoming head detections. | |
Protected Attributes | |
std::string | data_directory_ |
path to the classifier model | |
bool | display_timing_ |
FaceDetector | face_detector_ |
implementation of the face detector | |
ros::Publisher | face_position_publisher_ |
publisher for the positions of the detected faces | |
ros::Subscriber | head_position_subscriber_ |
subscribes to the positions of detected head regions | |
ros::NodeHandle | node_handle_ |
Definition at line 79 of file face_detector_node.h.
FaceDetectorNode::~FaceDetectorNode | ( | void | ) |
Destructor.
Definition at line 132 of file face_detector_node.cpp.
void FaceDetectorNode::head_positions_callback | ( | const cob_perception_msgs::ColorDepthImageArray::ConstPtr & | head_positions | ) | [protected] |
Callback for incoming head detections.
Definition at line 141 of file face_detector_node.cpp.
std::string ipa_PeopleDetector::FaceDetectorNode::data_directory_ [protected] |
path to the classifier model
Definition at line 103 of file face_detector_node.h.
bool ipa_PeopleDetector::FaceDetectorNode::display_timing_ [protected] |
Definition at line 104 of file face_detector_node.h.
implementation of the face detector
Definition at line 100 of file face_detector_node.h.
publisher for the positions of the detected faces
Definition at line 98 of file face_detector_node.h.
subscribes to the positions of detected head regions
Definition at line 96 of file face_detector_node.h.
Definition at line 94 of file face_detector_node.h.