This is the complete list of members for
MotionDetection, including all inherited members.
camera_sub_ | MotionDetection | [private] |
colorizeDepth(const cv::Mat &gray, cv::Mat &rgb) const | MotionDetection | [private] |
computeOpticalFlow(const cv::Mat &prev_img, const cv::Mat &cur_img, cv::Mat &optical_flow, bool use_initial_flow=false, bool filter=false) const | MotionDetection | [private] |
computeOpticalFlowMagnitude(const cv::Mat &optical_flow, cv::Mat &optical_flow_mag) const | MotionDetection | [private] |
detectBlobs(const cv::Mat &img, KeyPoints &keypoints) const | MotionDetection | [private] |
drawBlobs(cv::Mat &img, const KeyPoints &keypoints, double scale=1.0) const | MotionDetection | [private] |
drawOpticalFlowVectors(cv::Mat &img, const cv::Mat &optical_flow, int step=10, const cv::Scalar &color=CV_RGB(0, 255, 0)) const | MotionDetection | [private] |
dyn_rec_server_ | MotionDetection | [private] |
dynRecParamCallback(MotionDetectionConfig &config, uint32_t level) | MotionDetection | [private] |
flow_history | MotionDetection | [private] |
image_detected_pub_ | MotionDetection | [private] |
image_motion_pub_ | MotionDetection | [private] |
image_percept_pub_ | MotionDetection | [private] |
image_sub_ | MotionDetection | [private] |
imageCallback(const sensor_msgs::ImageConstPtr &img) | MotionDetection | [private] |
img_prev_col_ptr_ | MotionDetection | [private] |
img_prev_ptr_ | MotionDetection | [private] |
KeyPoints typedef | MotionDetection | |
last_img | MotionDetection | [private] |
motion_detect_dilation_size_ | MotionDetection | [private] |
motion_detect_downscale_factor_ | MotionDetection | [private] |
motion_detect_flow_history_size_ | MotionDetection | [private] |
motion_detect_image_flow_filter_ | MotionDetection | [private] |
motion_detect_inv_sensivity_ | MotionDetection | [private] |
motion_detect_min_area_ | MotionDetection | [private] |
motion_detect_min_blob_dist_ | MotionDetection | [private] |
motion_detect_threshold_ | MotionDetection | [private] |
motion_detect_use_initial_flow_ | MotionDetection | [private] |
MotionDetection() | MotionDetection | |
optical_flow | MotionDetection | [private] |
percept_class_id_ | MotionDetection | [private] |
update(const ros::TimerEvent &event) | MotionDetection | [private] |
update_timer | MotionDetection | [private] |
~MotionDetection() | MotionDetection | |