Private Types | |
typedef sensor_msgs::PointCloud2 | PointCloud |
typedef message_filters::Synchronizer < SyncPolicy > | Synchronizer |
typedef ApproximateTime < sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo > | SyncPolicy |
Private Member Functions | |
void | connectCb () |
template<typename T , typename T2 > | |
void | convert (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::ImageConstPtr &intensity_msg, const PointCloud::Ptr &cloud_msg) |
void | imageCb (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::ImageConstPtr &intensity_msg, const sensor_msgs::CameraInfoConstPtr &info_msg) |
virtual void | onInit () |
Private Attributes | |
boost::mutex | connect_mutex_ |
boost::shared_ptr < image_transport::ImageTransport > | depth_it_ |
boost::shared_ptr < image_transport::ImageTransport > | intensity_it_ |
ros::NodeHandlePtr | intensity_nh_ |
image_geometry::PinholeCameraModel | model_ |
ros::Publisher | pub_point_cloud_ |
image_transport::SubscriberFilter | sub_depth_ |
message_filters::Subscriber < sensor_msgs::CameraInfo > | sub_info_ |
image_transport::SubscriberFilter | sub_intensity_ |
boost::shared_ptr< Synchronizer > | sync_ |
Definition at line 59 of file point_cloud_xyzi.cpp.
typedef sensor_msgs::PointCloud2 depth_image_proc::PointCloudXyziNodelet::PointCloud [private] |
Definition at line 73 of file point_cloud_xyzi.cpp.
typedef message_filters::Synchronizer<SyncPolicy> depth_image_proc::PointCloudXyziNodelet::Synchronizer [private] |
Definition at line 68 of file point_cloud_xyzi.cpp.
typedef ApproximateTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo> depth_image_proc::PointCloudXyziNodelet::SyncPolicy [private] |
Definition at line 67 of file point_cloud_xyzi.cpp.
void depth_image_proc::PointCloudXyziNodelet::connectCb | ( | ) | [private] |
Definition at line 117 of file point_cloud_xyzi.cpp.
void depth_image_proc::PointCloudXyziNodelet::convert | ( | const sensor_msgs::ImageConstPtr & | depth_msg, |
const sensor_msgs::ImageConstPtr & | intensity_msg, | ||
const PointCloud::Ptr & | cloud_msg | ||
) | [private] |
Definition at line 262 of file point_cloud_xyzi.cpp.
void depth_image_proc::PointCloudXyziNodelet::imageCb | ( | const sensor_msgs::ImageConstPtr & | depth_msg, |
const sensor_msgs::ImageConstPtr & | intensity_msg, | ||
const sensor_msgs::CameraInfoConstPtr & | info_msg | ||
) | [private] |
Definition at line 143 of file point_cloud_xyzi.cpp.
void depth_image_proc::PointCloudXyziNodelet::onInit | ( | ) | [private, virtual] |
Implements nodelet::Nodelet.
Definition at line 92 of file point_cloud_xyzi.cpp.
boost::mutex depth_image_proc::PointCloudXyziNodelet::connect_mutex_ [private] |
Definition at line 72 of file point_cloud_xyzi.cpp.
boost::shared_ptr<image_transport::ImageTransport> depth_image_proc::PointCloudXyziNodelet::depth_it_ [private] |
Definition at line 62 of file point_cloud_xyzi.cpp.
boost::shared_ptr<image_transport::ImageTransport> depth_image_proc::PointCloudXyziNodelet::intensity_it_ [private] |
Definition at line 62 of file point_cloud_xyzi.cpp.
Definition at line 61 of file point_cloud_xyzi.cpp.
Definition at line 76 of file point_cloud_xyzi.cpp.
Definition at line 74 of file point_cloud_xyzi.cpp.
Definition at line 65 of file point_cloud_xyzi.cpp.
message_filters::Subscriber<sensor_msgs::CameraInfo> depth_image_proc::PointCloudXyziNodelet::sub_info_ [private] |
Definition at line 66 of file point_cloud_xyzi.cpp.
Definition at line 65 of file point_cloud_xyzi.cpp.
boost::shared_ptr<Synchronizer> depth_image_proc::PointCloudXyziNodelet::sync_ [private] |
Definition at line 69 of file point_cloud_xyzi.cpp.