Private Types | Private Member Functions | Private Attributes | List of all members
image_proc::CropDecimateNodelet Class Reference
Inheritance diagram for image_proc::CropDecimateNodelet:
Inheritance graph
[legend]

Private Types

typedef image_proc::CropDecimateConfig Config
 
typedef dynamic_reconfigure::Server< ConfigReconfigureServer
 

Private Member Functions

void configCb (Config &config, uint32_t level)
 
void connectCb ()
 
void imageCb (const sensor_msgs::ImageConstPtr &image_msg, const sensor_msgs::CameraInfoConstPtr &info_msg)
 
virtual void onInit ()
 

Private Attributes

Config config_
 
boost::recursive_mutex config_mutex_
 
boost::mutex connect_mutex_
 
boost::shared_ptr< image_transport::ImageTransportit_in_
 
boost::shared_ptr< image_transport::ImageTransportit_out_
 
image_transport::CameraPublisher pub_
 
int queue_size_
 
boost::shared_ptr< ReconfigureServerreconfigure_server_
 
image_transport::CameraSubscriber sub_
 
std::string target_frame_id_
 

Additional Inherited Members

- 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 ()
 
- 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 52 of file crop_decimate.cpp.

Member Typedef Documentation

◆ Config

typedef image_proc::CropDecimateConfig image_proc::CropDecimateNodelet::Config
private

Definition at line 65 of file crop_decimate.cpp.

◆ ReconfigureServer

typedef dynamic_reconfigure::Server<Config> image_proc::CropDecimateNodelet::ReconfigureServer
private

Definition at line 66 of file crop_decimate.cpp.

Member Function Documentation

◆ configCb()

void image_proc::CropDecimateNodelet::configCb ( Config config,
uint32_t  level 
)
private

Definition at line 356 of file crop_decimate.cpp.

◆ connectCb()

void image_proc::CropDecimateNodelet::connectCb ( )
private

Definition at line 107 of file crop_decimate.cpp.

◆ imageCb()

void image_proc::CropDecimateNodelet::imageCb ( const sensor_msgs::ImageConstPtr &  image_msg,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)
private
Todo:
Check image dimensions match info_msg
Todo:
Publish tweaks to config_ so they appear in reconfigure_gui
Todo:
Could save copies by allocating this above and having output.image alias it

Definition at line 172 of file crop_decimate.cpp.

◆ onInit()

void image_proc::CropDecimateNodelet::onInit ( )
privatevirtual

Implements nodelet::Nodelet.

Definition at line 80 of file crop_decimate.cpp.

Member Data Documentation

◆ config_

Config image_proc::CropDecimateNodelet::config_
private

Definition at line 68 of file crop_decimate.cpp.

◆ config_mutex_

boost::recursive_mutex image_proc::CropDecimateNodelet::config_mutex_
private

Definition at line 64 of file crop_decimate.cpp.

◆ connect_mutex_

boost::mutex image_proc::CropDecimateNodelet::connect_mutex_
private

Definition at line 60 of file crop_decimate.cpp.

◆ it_in_

boost::shared_ptr<image_transport::ImageTransport> image_proc::CropDecimateNodelet::it_in_
private

Definition at line 55 of file crop_decimate.cpp.

◆ it_out_

boost::shared_ptr<image_transport::ImageTransport> image_proc::CropDecimateNodelet::it_out_
private

Definition at line 55 of file crop_decimate.cpp.

◆ pub_

image_transport::CameraPublisher image_proc::CropDecimateNodelet::pub_
private

Definition at line 61 of file crop_decimate.cpp.

◆ queue_size_

int image_proc::CropDecimateNodelet::queue_size_
private

Definition at line 57 of file crop_decimate.cpp.

◆ reconfigure_server_

boost::shared_ptr<ReconfigureServer> image_proc::CropDecimateNodelet::reconfigure_server_
private

Definition at line 67 of file crop_decimate.cpp.

◆ sub_

image_transport::CameraSubscriber image_proc::CropDecimateNodelet::sub_
private

Definition at line 56 of file crop_decimate.cpp.

◆ target_frame_id_

std::string image_proc::CropDecimateNodelet::target_frame_id_
private

Definition at line 58 of file crop_decimate.cpp.


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


image_proc
Author(s): Patrick Mihelich, Kurt Konolige, Jeremy Leibs
autogenerated on Wed Dec 7 2022 03:25:23