Public Member Functions | Private Attributes | List of all members
swri_image_util::ContrastStretchNodelet Class Reference
Inheritance diagram for swri_image_util::ContrastStretchNodelet:
Inheritance graph
[legend]

Public Member Functions

 ContrastStretchNodelet ()
 
void ImageCallback (const sensor_msgs::ImageConstPtr &image)
 
void onInit ()
 
 ~ContrastStretchNodelet ()
 
- Public Member Functions inherited from nodelet::Nodelet
void init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)
 
 Nodelet ()
 
virtual ~Nodelet ()
 

Private Attributes

int32_t bins_
 
image_transport::Publisher image_pub_
 
image_transport::Subscriber image_sub_
 
cv::Mat mask_
 
double max_min_
 
double min_max_
 
int32_t over_exposure_dilation_
 
double over_exposure_threshold_
 

Additional Inherited Members

- Protected Member Functions inherited from nodelet::Nodelet
ros::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::string & getName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Detailed Description

Definition at line 48 of file contrast_stretch_nodelet.cpp.

Constructor & Destructor Documentation

swri_image_util::ContrastStretchNodelet::ContrastStretchNodelet ( )
inline

Definition at line 51 of file contrast_stretch_nodelet.cpp.

swri_image_util::ContrastStretchNodelet::~ContrastStretchNodelet ( )
inline

Definition at line 60 of file contrast_stretch_nodelet.cpp.

Member Function Documentation

void swri_image_util::ContrastStretchNodelet::ImageCallback ( const sensor_msgs::ImageConstPtr &  image)
inline

Definition at line 87 of file contrast_stretch_nodelet.cpp.

void swri_image_util::ContrastStretchNodelet::onInit ( )
inlinevirtual

Implements nodelet::Nodelet.

Definition at line 64 of file contrast_stretch_nodelet.cpp.

Member Data Documentation

int32_t swri_image_util::ContrastStretchNodelet::bins_
private

Definition at line 125 of file contrast_stretch_nodelet.cpp.

image_transport::Publisher swri_image_util::ContrastStretchNodelet::image_pub_
private

Definition at line 134 of file contrast_stretch_nodelet.cpp.

image_transport::Subscriber swri_image_util::ContrastStretchNodelet::image_sub_
private

Definition at line 133 of file contrast_stretch_nodelet.cpp.

cv::Mat swri_image_util::ContrastStretchNodelet::mask_
private

Definition at line 131 of file contrast_stretch_nodelet.cpp.

double swri_image_util::ContrastStretchNodelet::max_min_
private

Definition at line 126 of file contrast_stretch_nodelet.cpp.

double swri_image_util::ContrastStretchNodelet::min_max_
private

Definition at line 127 of file contrast_stretch_nodelet.cpp.

int32_t swri_image_util::ContrastStretchNodelet::over_exposure_dilation_
private

Definition at line 129 of file contrast_stretch_nodelet.cpp.

double swri_image_util::ContrastStretchNodelet::over_exposure_threshold_
private

Definition at line 128 of file contrast_stretch_nodelet.cpp.


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


swri_image_util
Author(s): Kris Kozak
autogenerated on Fri Jun 7 2019 22:05:56