Public Member Functions | |
virtual void | onInit () |
Initialize nodehandles nh_ and pnh_. Subclass should call this method in its onInit method. | |
Private Types | |
typedef opencv_apps::ThresholdConfig | Config |
typedef dynamic_reconfigure::Server < Config > | ReconfigureServer |
Private Member Functions | |
void | doWork (const sensor_msgs::Image::ConstPtr &image_msg, const std::string &input_frame_from_msg) |
void | imageCallback (const sensor_msgs::ImageConstPtr &msg) |
void | imageCallbackWithInfo (const sensor_msgs::ImageConstPtr &msg, const sensor_msgs::CameraInfoConstPtr &cam_info) |
void | reconfigureCallback (Config &config, uint32_t level) |
void | subscribe () |
This method is called when publisher is subscribed by other nodes. Set up subscribers in this method. | |
void | unsubscribe () |
This method is called when publisher is unsubscribed by other nodes. Shut down subscribers in this method. | |
Private Attributes | |
bool | apply_otsu_ |
image_transport::CameraSubscriber | cam_sub_ |
Config | config_ |
bool | debug_view_ |
image_transport::Publisher | img_pub_ |
image_transport::Subscriber | img_sub_ |
boost::shared_ptr < image_transport::ImageTransport > | it_ |
int | max_binary_value_ |
boost::mutex | mutex_ |
int | queue_size_ |
boost::shared_ptr < ReconfigureServer > | reconfigure_server_ |
int | threshold_type_ |
int | threshold_value_ |
std::string | window_name_ |
Definition at line 56 of file threshold_nodelet.cpp.
typedef opencv_apps::ThresholdConfig opencv_apps::ThresholdNodelet::Config [private] |
Definition at line 61 of file threshold_nodelet.cpp.
typedef dynamic_reconfigure::Server<Config> opencv_apps::ThresholdNodelet::ReconfigureServer [private] |
Definition at line 62 of file threshold_nodelet.cpp.
void opencv_apps::ThresholdNodelet::doWork | ( | const sensor_msgs::Image::ConstPtr & | image_msg, |
const std::string & | input_frame_from_msg | ||
) | [inline, private] |
Definition at line 119 of file threshold_nodelet.cpp.
void opencv_apps::ThresholdNodelet::imageCallback | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [inline, private] |
Definition at line 88 of file threshold_nodelet.cpp.
void opencv_apps::ThresholdNodelet::imageCallbackWithInfo | ( | const sensor_msgs::ImageConstPtr & | msg, |
const sensor_msgs::CameraInfoConstPtr & | cam_info | ||
) | [inline, private] |
Definition at line 83 of file threshold_nodelet.cpp.
virtual void opencv_apps::ThresholdNodelet::onInit | ( | ) | [inline, virtual] |
Initialize nodehandles nh_ and pnh_. Subclass should call this method in its onInit method.
Reimplemented from opencv_apps::Nodelet.
Reimplemented in threshold::ThresholdNodelet.
Definition at line 150 of file threshold_nodelet.cpp.
void opencv_apps::ThresholdNodelet::reconfigureCallback | ( | Config & | config, |
uint32_t | level | ||
) | [inline, private] |
Definition at line 109 of file threshold_nodelet.cpp.
void opencv_apps::ThresholdNodelet::subscribe | ( | ) | [inline, private, virtual] |
This method is called when publisher is subscribed by other nodes. Set up subscribers in this method.
Implements opencv_apps::Nodelet.
Definition at line 93 of file threshold_nodelet.cpp.
void opencv_apps::ThresholdNodelet::unsubscribe | ( | ) | [inline, private, virtual] |
This method is called when publisher is unsubscribed by other nodes. Shut down subscribers in this method.
Implements opencv_apps::Nodelet.
Definition at line 102 of file threshold_nodelet.cpp.
bool opencv_apps::ThresholdNodelet::apply_otsu_ [private] |
Definition at line 81 of file threshold_nodelet.cpp.
Definition at line 73 of file threshold_nodelet.cpp.
Config opencv_apps::ThresholdNodelet::config_ [private] |
Definition at line 63 of file threshold_nodelet.cpp.
bool opencv_apps::ThresholdNodelet::debug_view_ [private] |
Definition at line 67 of file threshold_nodelet.cpp.
Definition at line 71 of file threshold_nodelet.cpp.
Definition at line 72 of file threshold_nodelet.cpp.
boost::shared_ptr<image_transport::ImageTransport> opencv_apps::ThresholdNodelet::it_ [private] |
Definition at line 75 of file threshold_nodelet.cpp.
int opencv_apps::ThresholdNodelet::max_binary_value_ [private] |
Definition at line 79 of file threshold_nodelet.cpp.
boost::mutex opencv_apps::ThresholdNodelet::mutex_ [private] |
Definition at line 77 of file threshold_nodelet.cpp.
int opencv_apps::ThresholdNodelet::queue_size_ [private] |
Definition at line 66 of file threshold_nodelet.cpp.
boost::shared_ptr<ReconfigureServer> opencv_apps::ThresholdNodelet::reconfigure_server_ [private] |
Definition at line 64 of file threshold_nodelet.cpp.
int opencv_apps::ThresholdNodelet::threshold_type_ [private] |
Definition at line 78 of file threshold_nodelet.cpp.
int opencv_apps::ThresholdNodelet::threshold_value_ [private] |
Definition at line 80 of file threshold_nodelet.cpp.
std::string opencv_apps::ThresholdNodelet::window_name_ [private] |
Definition at line 69 of file threshold_nodelet.cpp.