$search
#include "ros/ros.h"
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <pcl/ros/conversions.h>
#include <pcl/features/normal_3d.h>
#include <pcl/point_representation.h>
#include <pcl/kdtree/kdtree_flann.h>
#include <pcl/io/pcd_io.h>
#include <sensor_msgs/PointCloud2.h>
#include <cob_3d_mapping_msgs/ShapeArray.h>
#include <cob_3d_mapping_msgs/Shape.h>
#include <cob_3d_mapping_common/polygon.h>
#include <ros/time.h>
#include <math.h>
#include <Eigen/Core>
#include <boost/shared_ptr.hpp>
Go to the source code of this file.
Defines | |
#define | PI 3.14159265 |
Functions | |
void | fifthShape (cob_3d_mapping_msgs::Shape &s, Eigen::Vector3f normal, Eigen::Vector3f color) |
void | firstShape (cob_3d_mapping_msgs::Shape &s, Eigen::Vector3f normal, Eigen::Vector3f color) |
void | fourthShape (cob_3d_mapping_msgs::Shape &s, Eigen::Vector3f normal, Eigen::Vector3f color) |
int | main (int argc, char **argv) |
void | secondShape (cob_3d_mapping_msgs::Shape &s, Eigen::Vector3f normal, Eigen::Vector3f color) |
void | sixthShape (cob_3d_mapping_msgs::Shape &s, Eigen::Vector3f normal, Eigen::Vector3f color) |
void | thirdShape (cob_3d_mapping_msgs::Shape &s, Eigen::Vector3f normal, Eigen::Vector3f color) |
#define PI 3.14159265 |
Definition at line 21 of file test_shape_array.cpp.
void fifthShape | ( | cob_3d_mapping_msgs::Shape & | s, | |
Eigen::Vector3f | normal, | |||
Eigen::Vector3f | color | |||
) |
Definition at line 289 of file test_shape_array.cpp.
void firstShape | ( | cob_3d_mapping_msgs::Shape & | s, | |
Eigen::Vector3f | normal, | |||
Eigen::Vector3f | color | |||
) |
Definition at line 25 of file test_shape_array.cpp.
void fourthShape | ( | cob_3d_mapping_msgs::Shape & | s, | |
Eigen::Vector3f | normal, | |||
Eigen::Vector3f | color | |||
) |
Definition at line 188 of file test_shape_array.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 453 of file test_shape_array.cpp.
void secondShape | ( | cob_3d_mapping_msgs::Shape & | s, | |
Eigen::Vector3f | normal, | |||
Eigen::Vector3f | color | |||
) |
Definition at line 85 of file test_shape_array.cpp.
void sixthShape | ( | cob_3d_mapping_msgs::Shape & | s, | |
Eigen::Vector3f | normal, | |||
Eigen::Vector3f | color | |||
) |
Definition at line 399 of file test_shape_array.cpp.
void thirdShape | ( | cob_3d_mapping_msgs::Shape & | s, | |
Eigen::Vector3f | normal, | |||
Eigen::Vector3f | color | |||
) |
Definition at line 142 of file test_shape_array.cpp.