| Public Member Functions | |
| BlurEst (ros::NodeHandle &n, float m_blur, bool bls, string input_topic, string roi_topic) | |
| ~BlurEst () | |
| Protected Member Functions | |
| void | changeROI (const sensor_msgs::RegionOfInterestConstPtr &r) | 
| void | detect_sharp_area (const sensor_msgs::ImageConstPtr &ms) | 
| Protected Attributes | |
| bool | blocks | 
| sensor_msgs::CvBridge | bridge | 
| ros::ServiceClient | cl | 
| IplImage * | gray_image | 
| string | input_topic | 
| float | max_blur | 
| ros::NodeHandle | nh | 
| string | output_topic | 
| int | pattern_number | 
| ros::Publisher | pub | 
| CvRect | roi | 
| string | roi_input_topic | 
| bool | roi_set | 
| ros::Subscriber | sub | 
| ros::Subscriber | sub_roi | 
| IplImage * | white_image | 
| Static Protected Attributes | |
| static const int | threshold = 10 | 
| static const int | wait_time = 1000 | 
Definition at line 53 of file blur_estimation.cpp.
| BlurEst::BlurEst | ( | ros::NodeHandle & | n, | 
| float | m_blur, | ||
| bool | bls, | ||
| string | input_topic, | ||
| string | roi_topic | ||
| ) |  [inline] | 
Definition at line 332 of file blur_estimation.cpp.
| BlurEst::~BlurEst | ( | ) |  [inline] | 
Definition at line 342 of file blur_estimation.cpp.
| void BlurEst::changeROI | ( | const sensor_msgs::RegionOfInterestConstPtr & | r | ) |  [inline, protected] | 
Definition at line 84 of file blur_estimation.cpp.
| void BlurEst::detect_sharp_area | ( | const sensor_msgs::ImageConstPtr & | ms | ) |  [inline, protected] | 
Definition at line 96 of file blur_estimation.cpp.
| bool BlurEst::blocks  [protected] | 
Definition at line 74 of file blur_estimation.cpp.
| sensor_msgs::CvBridge BlurEst::bridge  [protected] | 
Definition at line 61 of file blur_estimation.cpp.
| ros::ServiceClient BlurEst::cl  [protected] | 
Definition at line 60 of file blur_estimation.cpp.
| IplImage* BlurEst::gray_image  [protected] | 
Definition at line 64 of file blur_estimation.cpp.
| string BlurEst::input_topic  [protected] | 
Definition at line 66 of file blur_estimation.cpp.
| float BlurEst::max_blur  [protected] | 
Definition at line 73 of file blur_estimation.cpp.
| ros::NodeHandle BlurEst::nh  [protected] | 
Definition at line 56 of file blur_estimation.cpp.
| string BlurEst::output_topic  [protected] | 
Definition at line 68 of file blur_estimation.cpp.
| int BlurEst::pattern_number  [protected] | 
Definition at line 77 of file blur_estimation.cpp.
| ros::Publisher BlurEst::pub  [protected] | 
Definition at line 59 of file blur_estimation.cpp.
| CvRect BlurEst::roi  [protected] | 
Definition at line 70 of file blur_estimation.cpp.
| string BlurEst::roi_input_topic  [protected] | 
Definition at line 67 of file blur_estimation.cpp.
| bool BlurEst::roi_set  [protected] | 
Definition at line 71 of file blur_estimation.cpp.
| ros::Subscriber BlurEst::sub  [protected] | 
Definition at line 57 of file blur_estimation.cpp.
| ros::Subscriber BlurEst::sub_roi  [protected] | 
Definition at line 58 of file blur_estimation.cpp.
| const int BlurEst::threshold = 10  [static, protected] | 
Definition at line 75 of file blur_estimation.cpp.
| const int BlurEst::wait_time = 1000  [static, protected] | 
Definition at line 82 of file blur_estimation.cpp.
| IplImage* BlurEst::white_image  [protected] | 
Definition at line 63 of file blur_estimation.cpp.