#include <algorithm>
#include <boost/filesystem.hpp>
#include <boost/shared_ptr.hpp>
#include <boost/thread.hpp>
#include <boost/version.hpp>
#include <iomanip>
#include <map>
#include <stdexcept>
#include <string>
#include <opencv2/opencv.hpp>
#include <pwd.h>
#include <vector>
#include <cv_bridge/cv_bridge.h>
#include <dynamic_reconfigure/server.h>
#include <image_transport/image_transport.h>
#include <image_transport/subscriber_filter.h>
#include <message_filters/subscriber.h>
#include <message_filters/synchronizer.h>
#include <message_filters/sync_policies/approximate_time.h>
#include <message_filters/sync_policies/exact_time.h>
#include <sensor_msgs/image_encodings.h>
#include <opencv_apps/nodelet.h>
#include <opencv_apps/FaceArrayStamped.h>
#include <opencv_apps/FaceRecognitionTrain.h>
#include <opencv_apps/FaceRecognitionConfig.h>
#include <pluginlib/class_list_macros.h>
Go to the source code of this file.
Classes | |
class | face_recognition::FaceRecognitionNodelet |
class | opencv_apps::FaceRecognitionNodelet |
class | opencv_apps::LabelMapper |
class | opencv_apps::Storage |
Namespaces | |
namespace | boost |
namespace | boost::filesystem3 |
namespace | face_recognition |
namespace | opencv_apps |
Demo code to calculate moments. | |
Functions | |
template<> | |
path & | boost::filesystem3::path::append< typename path::iterator > (typename path::iterator lhs, typename path::iterator rhs, const codecvt_type &cvt) |
PLUGINLIB_EXPORT_CLASS (opencv_apps::FaceRecognitionNodelet, nodelet::Nodelet) | |
PLUGINLIB_EXPORT_CLASS (face_recognition::FaceRecognitionNodelet, nodelet::Nodelet) | |
path | boost::filesystem3::user_expanded_path (const path &p) |