#include <stdlib.h>
#include <vector>
#include <iostream>
#include <point_cloud_mapping/kdtree/kdtree_ann.h>
#include <ias_descriptors_3d/all_descriptors.h>
Go to the source code of this file.
Functions | |
void | createPointCloud (sensor_msgs::PointCloud &data) |
int | main () |
Example program demonstrating how to use the desciptors_3d package. |
void createPointCloud | ( | sensor_msgs::PointCloud & | data | ) |
Definition at line 158 of file interest_point_example.cpp.
int main | ( | void | ) |
Example program demonstrating how to use the desciptors_3d package.
Definition at line 54 of file interest_point_example.cpp.