Public Types | Public Member Functions | Public Attributes | Protected Attributes | List of all members
jsk_pcl_ros::LineSegment Class Reference

#include <line_segment_detector.h>

Public Types

typedef boost::shared_ptr< LineSegmentPtr
 

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_
 

Detailed Description

Definition at line 91 of file line_segment_detector.h.

Member Typedef Documentation

◆ Ptr

Definition at line 126 of file line_segment_detector.h.

Constructor & Destructor Documentation

◆ LineSegment() [1/2]

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 86 of file line_segment_detector_nodelet.cpp.

◆ LineSegment() [2/2]

jsk_pcl_ros::LineSegment::LineSegment ( pcl::PointIndices::Ptr  indices,
pcl::ModelCoefficients::Ptr  coefficients 
)

Definition at line 79 of file line_segment_detector_nodelet.cpp.

◆ ~LineSegment()

jsk_pcl_ros::LineSegment::~LineSegment ( )
virtual

Definition at line 108 of file line_segment_detector_nodelet.cpp.

Member Function Documentation

◆ addMarkerLine()

bool jsk_pcl_ros::LineSegment::addMarkerLine ( visualization_msgs::Marker &  marker,
const pcl::PointCloud< pcl::PointXYZ >::Ptr cloud,
double  minimum_line_length 
)
virtual

Definition at line 132 of file line_segment_detector_nodelet.cpp.

◆ getCoefficients()

pcl::ModelCoefficients::Ptr jsk_pcl_ros::LineSegment::getCoefficients ( )
inline

Definition at line 141 of file line_segment_detector.h.

◆ getIndices()

pcl::PointIndices::Ptr jsk_pcl_ros::LineSegment::getIndices ( )
inline

Definition at line 140 of file line_segment_detector.h.

◆ getPoints()

pcl::PointCloud<pcl::PointXYZ>::Ptr jsk_pcl_ros::LineSegment::getPoints ( )
inline

Definition at line 142 of file line_segment_detector.h.

◆ getRawPoints()

pcl::PointCloud<pcl::PointXYZ>::Ptr jsk_pcl_ros::LineSegment::getRawPoints ( )
inline

Definition at line 143 of file line_segment_detector.h.

◆ toSegment()

jsk_recognition_utils::Line::Ptr jsk_pcl_ros::LineSegment::toSegment ( )
virtual

Definition at line 112 of file line_segment_detector_nodelet.cpp.

Member Data Documentation

◆ coefficients_

pcl::ModelCoefficients::Ptr jsk_pcl_ros::LineSegment::coefficients_
protected

Definition at line 147 of file line_segment_detector.h.

◆ header

std_msgs::Header jsk_pcl_ros::LineSegment::header

Definition at line 144 of file line_segment_detector.h.

◆ indices_

pcl::PointIndices::Ptr jsk_pcl_ros::LineSegment::indices_
protected

Definition at line 146 of file line_segment_detector.h.

◆ points_

pcl::PointCloud<pcl::PointXYZ>::Ptr jsk_pcl_ros::LineSegment::points_
protected

Definition at line 148 of file line_segment_detector.h.

◆ raw_points_

pcl::PointCloud<pcl::PointXYZ>::Ptr jsk_pcl_ros::LineSegment::raw_points_
protected

Definition at line 149 of file line_segment_detector.h.


The documentation for this class was generated from the following files:


jsk_pcl_ros
Author(s): Yohei Kakiuchi
autogenerated on Tue Jan 7 2025 04:05:46