Go to the documentation of this file.
37 #ifndef JSK_PERCEPTION_APPLY_MASK_IMAGE_H_
38 #define JSK_PERCEPTION_APPLY_MASK_IMAGE_H_
40 #include <jsk_topic_tools/diagnostic_nodelet.h>
41 #include <sensor_msgs/Image.h>
42 #include <sensor_msgs/CameraInfo.h>
50 class ApplyMaskImage:
public jsk_topic_tools::DiagnosticNodelet
67 const sensor_msgs::Image::ConstPtr& image_msg,
68 const sensor_msgs::Image::ConstPtr& mask_msg);
70 const sensor_msgs::CameraInfo::ConstPtr& info_msg);
message_filters::Subscriber< sensor_msgs::CameraInfo > sub_camera_info_
bool use_rectified_image_
boost::shared_ptr< message_filters::Synchronizer< SyncPolicy > > sync_
message_filters::sync_policies::ApproximateTime< sensor_msgs::Image, sensor_msgs::Image > ApproximateSyncPolicy
bool negative_before_clip_
boost::shared_ptr< message_filters::Synchronizer< ApproximateSyncPolicy > > async_
ros::Subscriber sub_info_
virtual void infoCallback(const sensor_msgs::CameraInfo::ConstPtr &info_msg)
ros::Publisher pub_image_
message_filters::sync_policies::ExactTime< sensor_msgs::Image, sensor_msgs::Image > SyncPolicy
virtual void apply(const sensor_msgs::Image::ConstPtr &image_msg, const sensor_msgs::Image::ConstPtr &mask_msg)
message_filters::Subscriber< sensor_msgs::Image > sub_image_
virtual ~ApplyMaskImage()
message_filters::Subscriber< sensor_msgs::Image > sub_mask_
double max_interval_duration_
ros::Publisher pub_camera_info_
bool mask_black_to_transparent_
virtual void unsubscribe()
sensor_msgs::CameraInfo::ConstPtr camera_info_
jsk_perception
Author(s): Manabu Saito, Ryohei Ueda
autogenerated on Fri May 16 2025 03:11:16