Public Member Functions | |
FindKeypoints (ros::NodeHandle nh_) | |
~FindKeypoints () | |
Protected Member Functions | |
void | contrastChange (cv::Mat in, cv::Mat &out) |
void | cvWindows () |
void | FeaturesDetection (cv::Mat in, cv::Mat &out) |
void | imageCB (const sensor_msgs::ImageConstPtr &msg) |
void | matrixCB (const opencv_tut::valueMatrixConstPtr &msg) |
void | sharpenImg (cv::Mat in, cv::Mat &out) |
Protected Attributes | |
image_transport::ImageTransport | _imageTransport |
float | alpha |
int | beta |
bool | combined_bool |
bool | contrast_bool |
std::string | detector_from_msg |
ros::Subscriber | gui_sub |
image_transport::Subscriber | image_sub |
bool | keypoints_bool |
int | one_one |
int | one_two |
int | one_zero |
bool | original_bool |
bool | sharpen_bool |
int | two_one |
int | two_two |
int | two_zero |
int | zero_one |
int | zero_two |
int | zero_zero |
Definition at line 53 of file find_keypoints.cpp.
Definition at line 83 of file find_keypoints.cpp.
Definition at line 98 of file find_keypoints.cpp.
void FindKeypoints::contrastChange | ( | cv::Mat | in, |
cv::Mat & | out | ||
) | [protected] |
Definition at line 227 of file find_keypoints.cpp.
void FindKeypoints::cvWindows | ( | ) | [protected] |
Definition at line 143 of file find_keypoints.cpp.
void FindKeypoints::FeaturesDetection | ( | cv::Mat | in, |
cv::Mat & | out | ||
) | [protected] |
Definition at line 236 of file find_keypoints.cpp.
void FindKeypoints::imageCB | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [protected] |
Definition at line 171 of file find_keypoints.cpp.
void FindKeypoints::matrixCB | ( | const opencv_tut::valueMatrixConstPtr & | msg | ) | [protected] |
Definition at line 103 of file find_keypoints.cpp.
void FindKeypoints::sharpenImg | ( | cv::Mat | in, |
cv::Mat & | out | ||
) | [protected] |
Definition at line 218 of file find_keypoints.cpp.
Definition at line 66 of file find_keypoints.cpp.
float FindKeypoints::alpha [protected] |
Definition at line 70 of file find_keypoints.cpp.
int FindKeypoints::beta [protected] |
Definition at line 71 of file find_keypoints.cpp.
bool FindKeypoints::combined_bool [protected] |
Definition at line 73 of file find_keypoints.cpp.
bool FindKeypoints::contrast_bool [protected] |
Definition at line 73 of file find_keypoints.cpp.
std::string FindKeypoints::detector_from_msg [protected] |
Definition at line 74 of file find_keypoints.cpp.
ros::Subscriber FindKeypoints::gui_sub [protected] |
Definition at line 68 of file find_keypoints.cpp.
image_transport::Subscriber FindKeypoints::image_sub [protected] |
Definition at line 67 of file find_keypoints.cpp.
bool FindKeypoints::keypoints_bool [protected] |
Definition at line 73 of file find_keypoints.cpp.
int FindKeypoints::one_one [protected] |
Definition at line 72 of file find_keypoints.cpp.
int FindKeypoints::one_two [protected] |
Definition at line 72 of file find_keypoints.cpp.
int FindKeypoints::one_zero [protected] |
Definition at line 72 of file find_keypoints.cpp.
bool FindKeypoints::original_bool [protected] |
Definition at line 73 of file find_keypoints.cpp.
bool FindKeypoints::sharpen_bool [protected] |
Definition at line 73 of file find_keypoints.cpp.
int FindKeypoints::two_one [protected] |
Definition at line 72 of file find_keypoints.cpp.
int FindKeypoints::two_two [protected] |
Definition at line 72 of file find_keypoints.cpp.
int FindKeypoints::two_zero [protected] |
Definition at line 72 of file find_keypoints.cpp.
int FindKeypoints::zero_one [protected] |
Definition at line 72 of file find_keypoints.cpp.
int FindKeypoints::zero_two [protected] |
Definition at line 72 of file find_keypoints.cpp.
int FindKeypoints::zero_zero [protected] |
Definition at line 72 of file find_keypoints.cpp.