Public Member Functions | |
| void | normals_callback (const sensor_msgs::PointCloud2ConstPtr &msg) |
| normals_computer (ros::NodeHandle *nn) | |
| ~normals_computer () | |
Private Attributes | |
| PointCloud< PointXYZRGBNormal > | cloud_normals |
| sensor_msgs::Image | ima |
| pcl::IntegralImageNormalEstimation < pcl::PointXYZRGB, pcl::Normal > | ne |
| ros::NodeHandle * | nh |
| PointCloud< Normal > | normals |
| ros::Publisher | pub |
| ros::Publisher | pub2 |
| ros::Subscriber | sub |
Definition at line 20 of file get_normals.cpp.
| normals_computer::normals_computer | ( | ros::NodeHandle * | nn | ) | [inline] |
Definition at line 36 of file get_normals.cpp.
| normals_computer::~normals_computer | ( | ) | [inline] |
Definition at line 51 of file get_normals.cpp.
| void normals_computer::normals_callback | ( | const sensor_msgs::PointCloud2ConstPtr & | msg | ) | [inline] |
Definition at line 53 of file get_normals.cpp.
PointCloud<PointXYZRGBNormal> normals_computer::cloud_normals [private] |
Definition at line 32 of file get_normals.cpp.
sensor_msgs::Image normals_computer::ima [private] |
Definition at line 27 of file get_normals.cpp.
pcl::IntegralImageNormalEstimation<pcl::PointXYZRGB, pcl::Normal> normals_computer::ne [private] |
Definition at line 30 of file get_normals.cpp.
ros::NodeHandle* normals_computer::nh [private] |
Definition at line 24 of file get_normals.cpp.
PointCloud<Normal> normals_computer::normals [private] |
Definition at line 33 of file get_normals.cpp.
ros::Publisher normals_computer::pub [private] |
Definition at line 22 of file get_normals.cpp.
ros::Publisher normals_computer::pub2 [private] |
Definition at line 23 of file get_normals.cpp.
ros::Subscriber normals_computer::sub [private] |
Definition at line 26 of file get_normals.cpp.