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

Public Member Functions

 ImageNodelet ()
 
 ~ImageNodelet ()
 
- 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 Member Functions

void imageCb (const sensor_msgs::ImageConstPtr &msg)
 
virtual void onInit ()
 

Static Private Member Functions

static void mouseCb (int event, int x, int y, int flags, void *param)
 

Private Attributes

bool autosize_
 
int count_
 
boost::format filename_format_
 
boost::mutex image_mutex_
 
bool initialized_
 
cv::Mat last_image_
 
image_transport::Subscriber sub_
 
std::string window_name_
 

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 69 of file image_nodelet.cpp.

Constructor & Destructor Documentation

image_view::ImageNodelet::ImageNodelet ( )

Definition at line 94 of file image_nodelet.cpp.

image_view::ImageNodelet::~ImageNodelet ( )

Definition at line 99 of file image_nodelet.cpp.

Member Function Documentation

void image_view::ImageNodelet::imageCb ( const sensor_msgs::ImageConstPtr &  msg)
private

Definition at line 154 of file image_nodelet.cpp.

void image_view::ImageNodelet::mouseCb ( int  event,
int  x,
int  y,
int  flags,
void *  param 
)
staticprivate
Todo:
Show full path, ask if user has permission to write there

Definition at line 187 of file image_nodelet.cpp.

void image_view::ImageNodelet::onInit ( )
privatevirtual

Implements nodelet::Nodelet.

Definition at line 104 of file image_nodelet.cpp.

Member Data Documentation

bool image_view::ImageNodelet::autosize_
private

Definition at line 77 of file image_nodelet.cpp.

int image_view::ImageNodelet::count_
private

Definition at line 79 of file image_nodelet.cpp.

boost::format image_view::ImageNodelet::filename_format_
private

Definition at line 78 of file image_nodelet.cpp.

boost::mutex image_view::ImageNodelet::image_mutex_
private

Definition at line 73 of file image_nodelet.cpp.

bool image_view::ImageNodelet::initialized_
private

Definition at line 80 of file image_nodelet.cpp.

cv::Mat image_view::ImageNodelet::last_image_
private

Definition at line 74 of file image_nodelet.cpp.

image_transport::Subscriber image_view::ImageNodelet::sub_
private

Definition at line 71 of file image_nodelet.cpp.

std::string image_view::ImageNodelet::window_name_
private

Definition at line 76 of file image_nodelet.cpp.


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


image_view
Author(s): Patrick Mihelich
autogenerated on Thu Nov 7 2019 03:45:05