Definition at line 59 of file point_cloud_xyzrgb.cpp.
typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo> rtabmap_ros::PointCloudXYZRGB::MyApproxSyncDepthPolicy [private] |
Definition at line 299 of file point_cloud_xyzrgb.cpp.
typedef message_filters::sync_policies::ApproximateTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo, sensor_msgs::CameraInfo> rtabmap_ros::PointCloudXYZRGB::MyApproxSyncStereoPolicy [private] |
Definition at line 302 of file point_cloud_xyzrgb.cpp.
typedef message_filters::sync_policies::ExactTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo> rtabmap_ros::PointCloudXYZRGB::MyExactSyncDepthPolicy [private] |
Definition at line 305 of file point_cloud_xyzrgb.cpp.
typedef message_filters::sync_policies::ExactTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo, sensor_msgs::CameraInfo> rtabmap_ros::PointCloudXYZRGB::MyExactSyncStereoPolicy [private] |
Definition at line 308 of file point_cloud_xyzrgb.cpp.
rtabmap_ros::PointCloudXYZRGB::PointCloudXYZRGB | ( | ) | [inline] |
Definition at line 62 of file point_cloud_xyzrgb.cpp.
virtual rtabmap_ros::PointCloudXYZRGB::~PointCloudXYZRGB | ( | ) | [inline, virtual] |
Definition at line 74 of file point_cloud_xyzrgb.cpp.
void rtabmap_ros::PointCloudXYZRGB::depthCallback | ( | const sensor_msgs::ImageConstPtr & | image, |
const sensor_msgs::ImageConstPtr & | imageDepth, | ||
const sensor_msgs::CameraInfoConstPtr & | cameraInfo | ||
) | [inline, private] |
Definition at line 153 of file point_cloud_xyzrgb.cpp.
virtual void rtabmap_ros::PointCloudXYZRGB::onInit | ( | ) | [inline, private, virtual] |
Implements nodelet::Nodelet.
Definition at line 87 of file point_cloud_xyzrgb.cpp.
void rtabmap_ros::PointCloudXYZRGB::processAndPublish | ( | pcl::PointCloud< pcl::PointXYZRGB >::Ptr & | pclCloud, |
const std_msgs::Header & | header | ||
) | [inline, private] |
Definition at line 251 of file point_cloud_xyzrgb.cpp.
void rtabmap_ros::PointCloudXYZRGB::stereoCallback | ( | const sensor_msgs::ImageConstPtr & | imageLeft, |
const sensor_msgs::ImageConstPtr & | imageRight, | ||
const sensor_msgs::CameraInfoConstPtr & | camInfoLeft, | ||
const sensor_msgs::CameraInfoConstPtr & | camInfoRight | ||
) | [inline, private] |
Definition at line 197 of file point_cloud_xyzrgb.cpp.
message_filters::Synchronizer<MyApproxSyncDepthPolicy>* rtabmap_ros::PointCloudXYZRGB::approxSyncDepth_ [private] |
Definition at line 300 of file point_cloud_xyzrgb.cpp.
message_filters::Synchronizer<MyApproxSyncStereoPolicy>* rtabmap_ros::PointCloudXYZRGB::approxSyncStereo_ [private] |
Definition at line 303 of file point_cloud_xyzrgb.cpp.
message_filters::Subscriber<sensor_msgs::CameraInfo> rtabmap_ros::PointCloudXYZRGB::cameraInfoLeft_ [private] |
Definition at line 296 of file point_cloud_xyzrgb.cpp.
message_filters::Subscriber<sensor_msgs::CameraInfo> rtabmap_ros::PointCloudXYZRGB::cameraInfoRight_ [private] |
Definition at line 297 of file point_cloud_xyzrgb.cpp.
message_filters::Subscriber<sensor_msgs::CameraInfo> rtabmap_ros::PointCloudXYZRGB::cameraInfoSub_ [private] |
Definition at line 292 of file point_cloud_xyzrgb.cpp.
Definition at line 288 of file point_cloud_xyzrgb.cpp.
int rtabmap_ros::PointCloudXYZRGB::decimation_ [private] |
Definition at line 284 of file point_cloud_xyzrgb.cpp.
message_filters::Synchronizer<MyExactSyncDepthPolicy>* rtabmap_ros::PointCloudXYZRGB::exactSyncDepth_ [private] |
Definition at line 306 of file point_cloud_xyzrgb.cpp.
message_filters::Synchronizer<MyExactSyncStereoPolicy>* rtabmap_ros::PointCloudXYZRGB::exactSyncStereo_ [private] |
Definition at line 309 of file point_cloud_xyzrgb.cpp.
Definition at line 291 of file point_cloud_xyzrgb.cpp.
Definition at line 294 of file point_cloud_xyzrgb.cpp.
Definition at line 295 of file point_cloud_xyzrgb.cpp.
Definition at line 290 of file point_cloud_xyzrgb.cpp.
double rtabmap_ros::PointCloudXYZRGB::maxDepth_ [private] |
Definition at line 282 of file point_cloud_xyzrgb.cpp.
int rtabmap_ros::PointCloudXYZRGB::noiseFilterMinNeighbors_ [private] |
Definition at line 286 of file point_cloud_xyzrgb.cpp.
double rtabmap_ros::PointCloudXYZRGB::noiseFilterRadius_ [private] |
Definition at line 285 of file point_cloud_xyzrgb.cpp.
double rtabmap_ros::PointCloudXYZRGB::voxelSize_ [private] |
Definition at line 283 of file point_cloud_xyzrgb.cpp.