$search
#include "cob_people_detection/face_detection.h"
#include <pluginlib/class_list_macros.h>
#include "cob_common/cob_vision_utils/common/include/cob_vision_utils/GlobalDefines.h"
#include "cob_common/cob_vision_utils/common/include/cob_vision_utils/VisionUtils.h"
#include <opencv/highgui.h>
Go to the source code of this file.
Functions | |
int | abs (int x) |
PLUGINLIB_DECLARE_CLASS (ipa_PeopleDetector, CobFaceDetectionNodelet, ipa_PeopleDetector::CobFaceDetectionNodelet, nodelet::Nodelet) | |
void | voidDeleter (sensor_msgs::PointCloud2 *const) |
int abs | ( | int | x | ) | [inline] |
Definition at line 1161 of file face_detection.cpp.
PLUGINLIB_DECLARE_CLASS | ( | ipa_PeopleDetector | , | |
CobFaceDetectionNodelet | , | |||
ipa_PeopleDetector::CobFaceDetectionNodelet | , | |||
nodelet::Nodelet | ||||
) |
void voidDeleter | ( | sensor_msgs::PointCloud2 * | const | ) |
Definition at line 75 of file face_detection.cpp.