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

Protected Types

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

Protected Member Functions

void configCb (Config &config, uint32_t level)
 
void imageCb (const sensor_msgs::ImageConstPtr &image_msg)
 
void infoCb (const sensor_msgs::CameraInfoConstPtr &info_msg)
 
virtual void onInit ()
 
virtual void subscribe ()
 
virtual void unsubscribe ()
 
- Protected Member Functions inherited from nodelet_topic_tools::NodeletLazy
ros::Publisher advertise (ros::NodeHandle &nh, std::string topic, int queue_size, bool latch=false)
 
virtual void connectionCallback (const ros::SingleSubscriberPublisher &pub)
 
virtual void onInitPostProcess ()
 
virtual void warnNeverSubscribedCallback (const ros::WallTimerEvent &event)
 
- 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
 

Protected Attributes

Config config_
 
boost::recursive_mutex config_mutex_
 
ros::Publisher pub_image_
 
ros::Publisher pub_info_
 
boost::shared_ptr< ReconfigureServerreconfigure_server_
 
ros::Subscriber sub_image_
 
ros::Subscriber sub_info_
 
- Protected Attributes inherited from nodelet_topic_tools::NodeletLazy
boost::mutex connection_mutex_
 
ConnectionStatus connection_status_
 
bool ever_subscribed_
 
bool lazy_
 
boost::shared_ptr< ros::NodeHandlenh_
 
boost::shared_ptr< ros::NodeHandlepnh_
 
std::vector< ros::Publisherpublishers_
 
ros::WallTimer timer_ever_subscribed_
 
bool verbose_connection_
 

Additional Inherited Members

- Public Member Functions inherited from nodelet_topic_tools::NodeletLazy
 NodeletLazy ()
 
- 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 ()
 

Detailed Description

Definition at line 47 of file resize.cpp.

Member Typedef Documentation

typedef image_proc::ResizeConfig image_proc::ResizeNodelet::Config
protected

Definition at line 58 of file resize.cpp.

typedef dynamic_reconfigure::Server<Config> image_proc::ResizeNodelet::ReconfigureServer
protected

Definition at line 59 of file resize.cpp.

Member Function Documentation

void image_proc::ResizeNodelet::configCb ( Config config,
uint32_t  level 
)
protected

Definition at line 88 of file resize.cpp.

void image_proc::ResizeNodelet::imageCb ( const sensor_msgs::ImageConstPtr &  image_msg)
protected

Definition at line 146 of file resize.cpp.

void image_proc::ResizeNodelet::infoCb ( const sensor_msgs::CameraInfoConstPtr &  info_msg)
protected

Definition at line 105 of file resize.cpp.

void image_proc::ResizeNodelet::onInit ( )
protectedvirtual

Reimplemented from nodelet_topic_tools::NodeletLazy.

Definition at line 73 of file resize.cpp.

void image_proc::ResizeNodelet::subscribe ( )
protectedvirtual

Implements nodelet_topic_tools::NodeletLazy.

Definition at line 93 of file resize.cpp.

void image_proc::ResizeNodelet::unsubscribe ( )
protectedvirtual

Implements nodelet_topic_tools::NodeletLazy.

Definition at line 99 of file resize.cpp.

Member Data Documentation

Config image_proc::ResizeNodelet::config_
protected

Definition at line 61 of file resize.cpp.

boost::recursive_mutex image_proc::ResizeNodelet::config_mutex_
protected

Definition at line 57 of file resize.cpp.

ros::Publisher image_proc::ResizeNodelet::pub_image_
protected

Definition at line 51 of file resize.cpp.

ros::Publisher image_proc::ResizeNodelet::pub_info_
protected

Definition at line 52 of file resize.cpp.

boost::shared_ptr<ReconfigureServer> image_proc::ResizeNodelet::reconfigure_server_
protected

Definition at line 60 of file resize.cpp.

ros::Subscriber image_proc::ResizeNodelet::sub_image_
protected

Definition at line 54 of file resize.cpp.

ros::Subscriber image_proc::ResizeNodelet::sub_info_
protected

Definition at line 53 of file resize.cpp.


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


image_proc
Author(s): Patrick Mihelich, Kurt Konolige, Jeremy Leibs
autogenerated on Fri May 3 2019 02:59:51