#include <sensor_msgs/Image.h>
#include <sensor_msgs/point_cloud2_iterator.h>
#include <image_geometry/pinhole_camera_model.h>
#include <depth_image_proc/depth_traits.h>
#include <limits>
Go to the source code of this file.
Namespaces | |
namespace | depth_image_proc |
Typedefs | |
typedef sensor_msgs::PointCloud2 | depth_image_proc::PointCloud |
Functions | |
template<typename T > | |
void | depth_image_proc::convert (const sensor_msgs::ImageConstPtr &depth_msg, PointCloud::Ptr &cloud_msg, const image_geometry::PinholeCameraModel &model, double range_max=0.0) |