
| Protected Types | |
| typedef image_proc::ResizeConfig | Config | 
| typedef dynamic_reconfigure::Server< Config > | ReconfigureServer | 
| Protected Member Functions | |
| void | configCb (Config &config, uint32_t level) | 
| void | connectCb () | 
| void | imageCb (const sensor_msgs::ImageConstPtr &image_msg) | 
| void | infoCb (const sensor_msgs::CameraInfoConstPtr &info_msg) | 
| virtual void | onInit () | 
|  Protected Member Functions inherited from nodelet::Nodelet | |
| ros::CallbackQueueInterface & | getMTCallbackQueue () const | 
| ros::NodeHandle & | getMTNodeHandle () const | 
| ros::NodeHandle & | getMTPrivateNodeHandle () const | 
| const V_string & | getMyArgv () const | 
| const std::string & | getName () const | 
| ros::NodeHandle & | getNodeHandle () const | 
| ros::NodeHandle & | getPrivateNodeHandle () const | 
| const M_string & | getRemappingArgs () const | 
| ros::CallbackQueueInterface & | getSTCallbackQueue () const | 
| std::string | getSuffixedName (const std::string &suffix) const | 
| Protected Attributes | |
| Config | config_ | 
| std::mutex | config_mutex_ | 
| std::mutex | connect_mutex_ | 
| std::shared_ptr< image_transport::ImageTransport > | it_ | 
| std::shared_ptr< ros::NodeHandle > | nh_ | 
| std::shared_ptr< ros::NodeHandle > | pnh_ | 
| std::shared_ptr< image_transport::ImageTransport > | private_it_ | 
| image_transport::Publisher | pub_image_ | 
| ros::Publisher | pub_info_ | 
| std::shared_ptr< ReconfigureServer > | reconfigure_server_ | 
| cv_bridge::CvImage | scaled_cv_ | 
| image_transport::Subscriber | sub_image_ | 
| ros::Subscriber | sub_info_ | 
| 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 () | 
Definition at line 79 of file resize.cpp.
| 
 | protected | 
Definition at line 127 of file resize.cpp.
| 
 | protected | 
Definition at line 128 of file resize.cpp.
| 
 | protected | 
Definition at line 154 of file resize.cpp.
| 
 | protected | 
Definition at line 133 of file resize.cpp.
| 
 | protected | 
Definition at line 206 of file resize.cpp.
| 
 | protected | 
Definition at line 160 of file resize.cpp.
| 
 | protectedvirtual | 
Implements nodelet::Nodelet.
Definition at line 110 of file resize.cpp.
| 
 | protected | 
Definition at line 130 of file resize.cpp.
| 
 | protected | 
Definition at line 126 of file resize.cpp.
| 
 | protected | 
Definition at line 123 of file resize.cpp.
| 
 | protected | 
Definition at line 122 of file resize.cpp.
| 
 | protected | 
Definition at line 115 of file resize.cpp.
| 
 | protected | 
Definition at line 116 of file resize.cpp.
| 
 | protected | 
Definition at line 122 of file resize.cpp.
| 
 | protected | 
Definition at line 117 of file resize.cpp.
| 
 | protected | 
Definition at line 118 of file resize.cpp.
| 
 | protected | 
Definition at line 129 of file resize.cpp.
| 
 | protected | 
Definition at line 131 of file resize.cpp.
| 
 | protected | 
Definition at line 119 of file resize.cpp.
| 
 | protected | 
Definition at line 120 of file resize.cpp.