#include <Eigen/Geometry>
#include <pcl/point_cloud.h>
#include <pcl/point_types.h>
#include <pcl/PointIndices.h>
#include <ros/node_handle.h>
#include <ros/subscriber.h>
#include <ros/time.h>
#include <ros/timer.h>
#include <tf/transform_listener.h>
#include <actionlib/server/simple_action_server.h>
#include <sensor_msgs/PointCloud.h>
#include <sensor_msgs/PointCloud2.h>
#include <geometry_msgs/PoseStamped.h>
#include <geometry_msgs/Vector3.h>
#include <moveit_msgs/PlanningScene.h>
#include <tedusar_box_detection_msgs/BoxDetectionAction.h>
Go to the source code of this file.
Classes | |
struct | tedusar_box_detection::BoxDetectionNode::Box |
class | tedusar_box_detection::BoxDetectionNode |
struct | tedusar_box_detection::BoxDetectionNode::Parameters |
Namespaces | |
namespace | tedusar_box_detection |
Defines | |
#define | EIGEN_DISABLE_UNALIGNED_ARRAY_ASSERT |
#define | EIGEN_DONT_VECTORIZE |
Definition at line 43 of file box_detection_node.h.
#define EIGEN_DONT_VECTORIZE |
Definition at line 42 of file box_detection_node.h.