Namespaces | Typedefs | Enumerations | Functions | Variables
funcs.h File Reference
#include <ros/ros.h>
#include <tf/tf.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/image_encodings.h>
#include <cv_bridge/cv_bridge.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <pcl/io/pcd_io.h>
#include <pcl/point_types.h>
Include dependency graph for funcs.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

namespace  srs_env_model_percp

Typedefs

typedef boost::array< int16_t, 2 > srs_env_model_percp::point2_t

Enumerations

enum  srs_env_model_percp::estimationModeEnum { srs_env_model_percp::MODE1 = 1, srs_env_model_percp::MODE2, srs_env_model_percp::MODE3 }
enum  srs_env_model_percp::subVariantsEnum { srs_env_model_percp::SV_NONE = 0, srs_env_model_percp::SV_1, srs_env_model_percp::SV_2 }

Functions

cv::Point3f srs_env_model_percp::backProject (cv::Point2i p, float z, float fx, float fy)
bool srs_env_model_percp::calcNearAndFarFaceDepth (cv::Mat &m, float f, float *z1, float *z2)
bool srs_env_model_percp::calcNearAndFarFaceDistance (cv::Mat &m, float fx, float fy, cv::Point2i roiLB, cv::Point2i roiRT, float *d1, float *d2)
bool srs_env_model_percp::calcStats (cv::Mat &m, float *mean, float *stdDev)
bool srs_env_model_percp::estimate2DConvexHull (const ros::Time &stamp, const std::vector< cv::Point3f > points, std::vector< cv::Point2i > &convexHull)
bool srs_env_model_percp::estimateBB (const ros::Time &stamp, const point2_t &p1, const point2_t &p2, int mode, cv::Point3f &bbLBF, cv::Point3f &bbRBF, cv::Point3f &bbRTF, cv::Point3f &bbLTF, cv::Point3f &bbLBB, cv::Point3f &bbRBB, cv::Point3f &bbRTB, cv::Point3f &bbLTB)
bool srs_env_model_percp::estimateBBPose (const cv::Point3f &bbLBF, const cv::Point3f &bbRBF, const cv::Point3f &bbRTF, const cv::Point3f &bbLTF, const cv::Point3f &bbLBB, const cv::Point3f &bbRBB, const cv::Point3f &bbRTB, const cv::Point3f &bbLTB, cv::Point3f &position, tf::Quaternion &orientation, cv::Point3f &scale)
bool srs_env_model_percp::estimateRect (const ros::Time &stamp, const cv::Point3f &bbLBF, const cv::Point3f &bbRBF, const cv::Point3f &bbRTF, const cv::Point3f &bbLTF, const cv::Point3f &bbLBB, const cv::Point3f &bbRBB, const cv::Point3f &bbRTB, const cv::Point3f &bbLTB, point2_t &p1, point2_t &p2)
cv::Point2i srs_env_model_percp::fwdProject (cv::Point3f p, float fx, float fy, float cx, float cy)

Variables

const int srs_env_model_percp::CACHE_SIZE = 10
const bool srs_env_model_percp::DEBUG = false
static const float srs_env_model_percp::PI = 3.1415926535
const int srs_env_model_percp::QUEUE_SIZE = 10


srs_env_model_percp
Author(s): Rostislav Hulik (ihulik@fit.vutbr.cz), Tomas Hodan, Michal Spanel (spanel@fit.vutbr.cz)
autogenerated on Mon Oct 6 2014 08:07:23