All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Properties Friends
Public Member Functions | Protected Attributes | Static Protected Attributes
face_contour_detector::filters::EdgeConnector Class Reference

Tries to connectect edges in an image. Uses an external python ros service (face_contour_detector/connectEdgesService.py) it has different properties than the graph based edge connector and is a bit slower. More...

#include <EdgeConnector.h>

Inheritance diagram for face_contour_detector::filters::EdgeConnector:
Inheritance graph
[legend]

List of all members.

Public Member Functions

virtual void Apply (const cv::Mat &input, cv::Mat &result)
 EdgeConnector (ros::NodeHandle &node)
virtual const std::string & GetFilterName ()
virtual std::vector
< filters::Parameter
GetParameters ()
virtual void ResetParameters ()
 Resets all the paramters of the filter to the default values.

Protected Attributes

ros::ServiceClient m_client
sensor_msgs::CvBridge m_cvBridge
int m_searchRadius

Static Protected Attributes

static std::string m_filterName = std::string("EdgeConnector")

Detailed Description

Tries to connectect edges in an image. Uses an external python ros service (face_contour_detector/connectEdgesService.py) it has different properties than the graph based edge connector and is a bit slower.

Definition at line 16 of file EdgeConnector.h.


Constructor & Destructor Documentation

Definition at line 10 of file EdgeConnector.cpp.


Member Function Documentation

void face_contour_detector::filters::EdgeConnector::Apply ( const cv::Mat &  input,
cv::Mat &  result 
) [virtual]

Applies the filter

Parameters:
inputthe data of this cv::Mat is beeing used as input for the filter
resultthe result will be saved here

Implements face_contour_detector::filters::Filter.

Definition at line 23 of file EdgeConnector.cpp.

Returns the name of the filter in std::string form

Returns:
the filter name

Implements face_contour_detector::filters::Filter.

Definition at line 45 of file EdgeConnector.cpp.

Returns a vector of the parameters of the filter

Returns:
vector of the parameters of this filter object

Implements face_contour_detector::filters::Filter.

Definition at line 16 of file EdgeConnector.cpp.

Resets all the paramters of the filter to the default values.

Implements face_contour_detector::filters::Filter.

Definition at line 41 of file EdgeConnector.cpp.


Member Data Documentation

Definition at line 27 of file EdgeConnector.h.

Definition at line 28 of file EdgeConnector.h.

std::string face_contour_detector::filters::EdgeConnector::m_filterName = std::string("EdgeConnector") [static, protected]

Definition at line 30 of file EdgeConnector.h.

Definition at line 25 of file EdgeConnector.h.


The documentation for this class was generated from the following files:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Properties Friends


face_contour_detector
Author(s): Fabian Wenzelmann and Julian Schmid
autogenerated on Wed Dec 26 2012 16:18:17