#include "door_angle_detector.h"#include "polygon_filter.h"#include "visualize_polygon.hpp"#include <std_msgs/Float64.h>#include <std_msgs/ColorRGBA.h>#include <pcl/filters/passthrough.h>#include <pcl/ros/conversions.h>#include <limits>#include <cmath>
Go to the source code of this file.
Functions | |
| int | main (int argc, char **argv) |
| 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. | |
| int main | ( | int | argc, |
| char ** | argv | ||
| ) |
Definition at line 188 of file door_angle_detector.cpp.
| 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.