31 #ifndef FETCH_DEPTH_LAYER_DEPTH_LAYER_H 32 #define FETCH_DEPTH_LAYER_DEPTH_LAYER_H 34 #include <boost/thread/mutex.hpp> 35 #include <boost/shared_ptr.hpp> 43 #include <opencv2/rgbd.hpp> 44 using cv::rgbd::DepthCleaner;
45 using cv::rgbd::RgbdNormals;
46 using cv::rgbd::RgbdPlane;
47 using cv::rgbd::depthTo3d;
76 const sensor_msgs::CameraInfo::ConstPtr& msg);
78 const sensor_msgs::Image::ConstPtr& msg);
138 #endif // FETCH_DEPTH_LAYER_DEPTH_LAYER_H
bool publish_observations_
ros::Subscriber camera_info_sub_
virtual ~FetchDepthLayer()
Destructor for the depth costmap layer.
cv::Ptr< DepthCleaner > depth_cleaner_
cv::Ptr< RgbdNormals > normals_estimator_
void depthImageCallback(const sensor_msgs::Image::ConstPtr &msg)
void cameraInfoCallback(const sensor_msgs::CameraInfo::ConstPtr &msg)
cv::Ptr< RgbdPlane > plane_estimator_
bool clear_with_skipped_rays_
double observations_threshold_
virtual void onInitialize()
Initialization function for the DepthLayer.
ros::Publisher clearing_pub_
boost::shared_ptr< tf2_ros::MessageFilter< sensor_msgs::Image > > depth_image_filter_
boost::shared_ptr< costmap_2d::ObservationBuffer > marking_buf_
ros::Publisher marking_pub_
A costmap layer that extracts ground plane and clears it.
boost::shared_ptr< message_filters::Subscriber< sensor_msgs::Image > > depth_image_sub_
boost::shared_ptr< costmap_2d::ObservationBuffer > clearing_buf_
FetchDepthLayer()
Constructor.