#include <ros/ros.h>
#include <tf/transform_listener.h>
#include "tf/message_filter.h"
#include "message_filters/subscriber.h"
#include <laser_geometry/laser_geometry.h>
#include <visualization_msgs/Marker.h>
#include <pcl/point_types.h>
#include <pcl/point_cloud.h>
#include <geometry_msgs/Point.h>
#include <door_perception_msgs/DoorState.h>
#include <door_perception_msgs/DoorStateSrv.h>
Go to the source code of this file.
Classes | |
class | DoorAngleDetector |
This class detects the door in 2D laser scans. More... | |
Typedefs | |
typedef pcl::PointCloud < PointType > | PointCloudType |
typedef pcl::PointXYZ | PointType |
Functions | |
visualization_msgs::Marker | visualize_door (geometry_msgs::Point p1, geometry_msgs::Point p2, std_msgs::Header header) |
Create a line marker where the door is supposed to be. |
typedef pcl::PointCloud<PointType> PointCloudType |
Definition at line 17 of file door_angle_detector.h.
typedef pcl::PointXYZ PointType |
Definition at line 16 of file door_angle_detector.h.
visualization_msgs::Marker visualize_door | ( | geometry_msgs::Point | p1, |
geometry_msgs::Point | p2, | ||
std_msgs::Header | header | ||
) |
Create a line marker where the door is supposed to be.
Definition at line 162 of file door_angle_detector.cpp.