#include <ros/ros.h>
#include <rospack/rospack.h>
#include <opencv/highgui.h>
#include <cv_bridge/cv_bridge.h>
#include <opencv/cv.hpp>
#include <posedetection_msgs/Feature0DDetect.h>
#include <posedetection_msgs/ImageFeature0D.h>
#include <posedetection_msgs/ObjectDetection.h>
#include <posedetection_msgs/Object6DPose.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/Quaternion.h>
#include <sensor_msgs/image_encodings.h>
#include <image_transport/image_transport.h>
#include <image_geometry/pinhole_camera_model.h>
#include <tf/tf.h>
#include <boost/shared_ptr.hpp>
#include <boost/foreach.hpp>
#include <boost/filesystem.hpp>
#include <vector>
#include <sstream>
#include <iostream>
#include <dynamic_reconfigure/server.h>
#include <jsk_perception/point_pose_extractorConfig.h>
#include <jsk_perception/SetTemplate.h>
#include <jsk_topic_tools/log_utils.h>
Go to the source code of this file.
Classes | |
class | Matching_Template |
class | PointPoseExtractor |
Functions | |
void | features2keypoint (posedetection_msgs::Feature0D features, std::vector< cv::KeyPoint > &keypoints, cv::Mat &descriptors) |
int | main (int argc, char **argv) |
Variables | |
bool | _first_sample_change |
void features2keypoint | ( | posedetection_msgs::Feature0D | features, |
std::vector< cv::KeyPoint > & | keypoints, | ||
cv::Mat & | descriptors | ||
) |
Definition at line 67 of file point_pose_extractor.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 1008 of file point_pose_extractor.cpp.
bool _first_sample_change |
Definition at line 65 of file point_pose_extractor.cpp.