#include <ros/ros.h>#include "sensor_msgs/PointCloud2.h"#include <pcl_ros/point_cloud.h>#include <pcl/point_types.h>#include <cmvision/Blobs.h>#include <cmvision/Blob.h>#include <boost/foreach.hpp>#include <cv_bridge/cv_bridge.h>
Go to the source code of this file.
Typedefs | |
| typedef pcl::PointCloud < pcl::PointXYZRGB > | PointCloud |
Functions | |
| void | blobCallback (const cmvision::Blobs::ConstPtr &msg) |
| void | imageCallback (const sensor_msgs::ImageConstPtr &msg) |
| int | main (int argc, char *argv[]) |
Variables | |
| cmvision::Blobs | blobs |
| cv_bridge::CvImagePtr | cv_ptr |
| PointCloud | depth |
| bool | g_blobs_ready = false |
| std::string | g_cloud_frame |
| bool | g_cloud_ready = false |
| typedef pcl::PointCloud<pcl::PointXYZRGB> PointCloud |
Definition at line 13 of file blobs_2_3d.cpp.
| void blobCallback | ( | const cmvision::Blobs::ConstPtr & | msg | ) |
Definition at line 26 of file blobs_2_3d.cpp.
| void imageCallback | ( | const sensor_msgs::ImageConstPtr & | msg | ) |
Definition at line 19 of file blobs_2_3d.cpp.
| int main | ( | int | argc, |
| char * | argv[] | ||
| ) |
Definition at line 31 of file blobs_2_3d.cpp.
| cmvision::Blobs blobs |
Definition at line 15 of file blobs_2_3d.cpp.
Definition at line 17 of file blobs_2_3d.cpp.
Definition at line 14 of file blobs_2_3d.cpp.
| bool g_blobs_ready = false |
Definition at line 11 of file blobs_2_3d.cpp.
| std::string g_cloud_frame |
Definition at line 12 of file blobs_2_3d.cpp.
| bool g_cloud_ready = false |
Definition at line 10 of file blobs_2_3d.cpp.