$search
#include <sensor_msgs/PointCloud.h>#include <geometric_shapes/bodies.h>#include <tf/transform_listener.h>#include <boost/bind.hpp>#include <string>#include <vector>#include "self_mask.hxx"#include "robot_self_filter/self_mask.h"#include <urdf/model.h>#include <resource_retriever/retriever.h>#include <geometric_shapes/shape_operations.h>#include <ros/console.h>#include <algorithm>#include <sstream>#include <climits>#include <assimp/assimp.hpp>#include <assimp/aiScene.h>#include <assimp/aiPostProcess.h>

Go to the source code of this file.
Classes | |
| struct | robot_self_filter::LinkInfo |
| struct | robot_self_filter::SelfMask< tpCloudType >::SeeLink |
| class | robot_self_filter::SelfMask< tpCloudType > |
| Computing a mask for a pointcloud that states which points are inside the robot. | |
| struct | robot_self_filter::SelfMask< tpCloudType >::SortBodies |
Namespaces | |
| namespace | robot_self_filter |
Enumerations | |
| enum | { robot_self_filter::INSIDE = 0, robot_self_filter::OUTSIDE = 1, robot_self_filter::SHADOW = 2 } |
The possible values of a mask computed for a point. More... | |