
| Private Types | |
| typedef image_proc::RectifyConfig | Config | 
| typedef dynamic_reconfigure::Server< Config > | ReconfigureServer | 
| 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::ImageTransport > | it_ | 
| image_geometry::PinholeCameraModel | model_ | 
| image_transport::Publisher | pub_rect_ | 
| int | queue_size_ | 
| boost::shared_ptr< ReconfigureServer > | reconfigure_server_ | 
| std::string | rectified_frame_suffix_ | 
| image_transport::CameraSubscriber | sub_camera_ | 
| 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::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 | 
Definition at line 81 of file rectify.cpp.
| 
 | private | 
Definition at line 126 of file rectify.cpp.
| 
 | private | 
Definition at line 127 of file rectify.cpp.
| 
 | private | 
Definition at line 202 of file rectify.cpp.
| 
 | private | 
Definition at line 135 of file rectify.cpp.
| 
 | private | 
Definition at line 147 of file rectify.cpp.
| 
 | privatevirtual | 
Implements nodelet::Nodelet.
Definition at line 112 of file rectify.cpp.
| 
 | private | 
Definition at line 129 of file rectify.cpp.
| 
 | private | 
Definition at line 125 of file rectify.cpp.
| 
 | private | 
Definition at line 121 of file rectify.cpp.
| 
 | private | 
Definition at line 116 of file rectify.cpp.
| 
 | private | 
Definition at line 132 of file rectify.cpp.
| 
 | private | 
Definition at line 122 of file rectify.cpp.
| 
 | private | 
Definition at line 118 of file rectify.cpp.
| 
 | private | 
Definition at line 128 of file rectify.cpp.
| 
 | private | 
Definition at line 119 of file rectify.cpp.
| 
 | private | 
Definition at line 117 of file rectify.cpp.