Public Member Functions | Private Member Functions | Private Attributes
MotionDetection Class Reference

#include <motion_detection.h>

List of all members.

Public Member Functions

 MotionDetection ()
 ~MotionDetection ()

Private Member Functions

void dynRecParamCallback (MotionDetectionConfig &config, uint32_t level)
void imageCallback (const sensor_msgs::ImageConstPtr &img)

Private Attributes

image_transport::CameraSubscriber camera_sub_
dynamic_reconfigure::Server
< MotionDetectionConfig > 
dyn_rec_server_
image_transport::CameraPublisher image_detected_pub_
image_transport::CameraPublisher image_motion_pub_
ros::Publisher image_percept_pub_
image_transport::Subscriber image_sub_
cv_bridge::CvImageConstPtr img_current_col_ptr_
cv_bridge::CvImageConstPtr img_current_ptr_
cv_bridge::CvImageConstPtr img_prev_ptr_
double max_percept_size
double min_density
double min_percept_size
int motion_detect_threshold_
std::string percept_class_id_

Detailed Description

Definition at line 21 of file motion_detection.h.


Constructor & Destructor Documentation

Definition at line 3 of file motion_detection.cpp.

Definition at line 26 of file motion_detection.cpp.


Member Function Documentation

void MotionDetection::dynRecParamCallback ( MotionDetectionConfig &  config,
uint32_t  level 
) [private]

Definition at line 161 of file motion_detection.cpp.

void MotionDetection::imageCallback ( const sensor_msgs::ImageConstPtr &  img) [private]

Definition at line 28 of file motion_detection.cpp.


Member Data Documentation

Definition at line 31 of file motion_detection.h.

dynamic_reconfigure::Server<MotionDetectionConfig> MotionDetection::dyn_rec_server_ [private]

Definition at line 37 of file motion_detection.h.

Definition at line 33 of file motion_detection.h.

Definition at line 32 of file motion_detection.h.

Definition at line 30 of file motion_detection.h.

Definition at line 35 of file motion_detection.h.

Definition at line 41 of file motion_detection.h.

Definition at line 40 of file motion_detection.h.

Definition at line 39 of file motion_detection.h.

Definition at line 44 of file motion_detection.h.

double MotionDetection::min_density [private]

Definition at line 45 of file motion_detection.h.

Definition at line 44 of file motion_detection.h.

Definition at line 43 of file motion_detection.h.

std::string MotionDetection::percept_class_id_ [private]

Definition at line 46 of file motion_detection.h.


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


hector_motion_detection
Author(s): Alexander Stumpf
autogenerated on Mon Oct 6 2014 10:37:00