#include <line_segment_detector.h>
Public Types | |
| typedef boost::shared_ptr< LineSegment > | Ptr |
Public Member Functions | |
| virtual bool | addMarkerLine (visualization_msgs::Marker &marker, const pcl::PointCloud< pcl::PointXYZ >::Ptr &cloud, double minimum_line_length) |
| pcl::ModelCoefficients::Ptr | getCoefficients () |
| pcl::PointIndices::Ptr | getIndices () |
| pcl::PointCloud< pcl::PointXYZ >::Ptr | getPoints () |
| pcl::PointCloud< pcl::PointXYZ >::Ptr | getRawPoints () |
| LineSegment (const std_msgs::Header &input_header, pcl::PointIndices::Ptr indices, pcl::ModelCoefficients::Ptr coefficients, pcl::PointCloud< pcl::PointXYZ >::Ptr cloud) | |
| LineSegment (pcl::PointIndices::Ptr indices, pcl::ModelCoefficients::Ptr coefficients) | |
| virtual jsk_recognition_utils::Line::Ptr | toSegment () |
| virtual | ~LineSegment () |
Public Attributes | |
| std_msgs::Header | header |
Protected Attributes | |
| pcl::ModelCoefficients::Ptr | coefficients_ |
| pcl::PointIndices::Ptr | indices_ |
| pcl::PointCloud< pcl::PointXYZ >::Ptr | points_ |
| pcl::PointCloud< pcl::PointXYZ >::Ptr | raw_points_ |
Definition at line 59 of file line_segment_detector.h.
Definition at line 62 of file line_segment_detector.h.
| jsk_pcl_ros::LineSegment::LineSegment | ( | const std_msgs::Header & | input_header, |
| pcl::PointIndices::Ptr | indices, | ||
| pcl::ModelCoefficients::Ptr | coefficients, | ||
| pcl::PointCloud< pcl::PointXYZ >::Ptr | cloud | ||
| ) |
Definition at line 54 of file line_segment_detector_nodelet.cpp.
| jsk_pcl_ros::LineSegment::LineSegment | ( | pcl::PointIndices::Ptr | indices, |
| pcl::ModelCoefficients::Ptr | coefficients | ||
| ) |
Definition at line 47 of file line_segment_detector_nodelet.cpp.
|
virtual |
Definition at line 76 of file line_segment_detector_nodelet.cpp.
|
virtual |
Definition at line 100 of file line_segment_detector_nodelet.cpp.
|
inline |
Definition at line 77 of file line_segment_detector.h.
|
inline |
Definition at line 76 of file line_segment_detector.h.
|
inline |
Definition at line 78 of file line_segment_detector.h.
|
inline |
Definition at line 79 of file line_segment_detector.h.
|
virtual |
Definition at line 80 of file line_segment_detector_nodelet.cpp.
|
protected |
Definition at line 83 of file line_segment_detector.h.
| std_msgs::Header jsk_pcl_ros::LineSegment::header |
Definition at line 80 of file line_segment_detector.h.
|
protected |
Definition at line 82 of file line_segment_detector.h.
|
protected |
Definition at line 84 of file line_segment_detector.h.
|
protected |
Definition at line 85 of file line_segment_detector.h.