37 #ifndef JSK_PCL_ROS_UTILS_DEPTH_IMAGE_ERROR_H_ 38 #define JSK_PCL_ROS_UTILS_DEPTH_IMAGE_ERROR_H_ 42 #include <sensor_msgs/Image.h> 43 #include <geometry_msgs/PointStamped.h> 44 #include <jsk_recognition_msgs/DepthErrorResult.h> 51 #include <sensor_msgs/CameraInfo.h> 61 geometry_msgs::PointStamped,
62 sensor_msgs::CameraInfo
66 geometry_msgs::PointStamped,
67 sensor_msgs::CameraInfo
72 virtual void calcError(
const sensor_msgs::Image::ConstPtr& depth_image,
73 const geometry_msgs::PointStamped::ConstPtr& uv_point,
74 const sensor_msgs::CameraInfo::ConstPtr& camera_info);
virtual void unsubscribe()
virtual void calcError(const sensor_msgs::Image::ConstPtr &depth_image, const geometry_msgs::PointStamped::ConstPtr &uv_point, const sensor_msgs::CameraInfo::ConstPtr &camera_info)
message_filters::Subscriber< sensor_msgs::Image > sub_image_
ros::Publisher depth_error_publisher_
boost::shared_ptr< message_filters::Synchronizer< ASyncPolicy > > async_
boost::shared_ptr< message_filters::Synchronizer< SyncPolicy > > sync_
message_filters::Subscriber< sensor_msgs::CameraInfo > sub_camera_info_
message_filters::sync_policies::ExactTime< sensor_msgs::Image, geometry_msgs::PointStamped, sensor_msgs::CameraInfo > SyncPolicy
message_filters::sync_policies::ApproximateTime< sensor_msgs::Image, geometry_msgs::PointStamped, sensor_msgs::CameraInfo > ASyncPolicy
message_filters::Subscriber< geometry_msgs::PointStamped > sub_point_