Public Member Functions | Protected Member Functions | Protected Attributes
CornerDetection Class Reference

List of all members.

Public Member Functions

 CornerDetection (ros::NodeHandle nh_)
 ~CornerDetection ()

Protected Member Functions

void imageCB (const sensor_msgs::ImageConstPtr &msg)
void myHarris_function (cv::Mat img, cv::Mat img_gray)
void myShiTomasi_function (cv::Mat img, cv::Mat img_gray, cv::Mat myShiTomasi_dst)

Protected Attributes

image_transport::ImageTransport _imageTransport
int apertureSize = 3
int blockSize_harris = 3
int blockSize_shi = 3
image_transport::Subscriber image_sub
int max_qualityLevel = 100
cv::Mat Mc
cv::Mat myHarris_copy
double myHarris_maxVal
double myHarris_minVal
int myHarris_qualityLevel = 50
cv::Mat myShiTomasi_copy
double myShiTomasi_maxVal
double myShiTomasi_minVal
int myShiTomasi_qualityLevel = 50

Detailed Description

Author:
Job van Dieten.

Definition at line 51 of file corner_detection.cpp.


Constructor & Destructor Documentation

Definition at line 79 of file corner_detection.cpp.

Definition at line 91 of file corner_detection.cpp.


Member Function Documentation

void CornerDetection::imageCB ( const sensor_msgs::ImageConstPtr &  msg) [protected]

Definition at line 96 of file corner_detection.cpp.

void CornerDetection::myHarris_function ( cv::Mat  img,
cv::Mat  img_gray 
) [protected]

Definition at line 145 of file corner_detection.cpp.

void CornerDetection::myShiTomasi_function ( cv::Mat  img,
cv::Mat  img_gray,
cv::Mat  myShiTomasi_dst 
) [protected]

Definition at line 160 of file corner_detection.cpp.


Member Data Documentation

Definition at line 62 of file corner_detection.cpp.

int CornerDetection::apertureSize = 3 [protected]

Definition at line 70 of file corner_detection.cpp.

int CornerDetection::blockSize_harris = 3 [protected]

Definition at line 69 of file corner_detection.cpp.

int CornerDetection::blockSize_shi = 3 [protected]

Definition at line 68 of file corner_detection.cpp.

Definition at line 63 of file corner_detection.cpp.

int CornerDetection::max_qualityLevel = 100 [protected]

Definition at line 67 of file corner_detection.cpp.

cv::Mat CornerDetection::Mc [protected]

Definition at line 71 of file corner_detection.cpp.

cv::Mat CornerDetection::myHarris_copy [protected]

Definition at line 71 of file corner_detection.cpp.

Definition at line 72 of file corner_detection.cpp.

Definition at line 72 of file corner_detection.cpp.

Definition at line 66 of file corner_detection.cpp.

cv::Mat CornerDetection::myShiTomasi_copy [protected]

Definition at line 71 of file corner_detection.cpp.

Definition at line 72 of file corner_detection.cpp.

Definition at line 72 of file corner_detection.cpp.

Definition at line 65 of file corner_detection.cpp.


The documentation for this class was generated from the following file:


opencv_tut
Author(s): Job van Dieten
autogenerated on Fri Aug 26 2016 13:20:16