Public Member Functions | Public Attributes | Protected Attributes
PointCloudPub Class Reference

List of all members.

Public Member Functions

sensor_msgs::PointCloud2 cloud_callback (const sensor_msgs::PointCloud2ConstPtr &msg)
bool get_cloud (UI_segment_object::GetObject::Request &reg, UI_segment_object::GetObject::Response &res)
bool get_pt (UI_segment_object::GetPt::Request &reg, UI_segment_object::GetPt::Response &res)
 PointCloudPub (ros::NodeHandle &nh)
geometry_msgs::Point pt_callback (const sensor_msgs::PointCloud2ConstPtr &msg)
void publish_object (const sensor_msgs::PointCloud2 &msg)
void publish_region (const sensor_msgs::PointCloud2 &msg)
bool reset_plane_coeff (UI_segment_object::None_Bool::Request &reg, UI_segment_object::None_Bool::Response &res)
bool save_cloud (UI_segment_object::Save::Request &reg, UI_segment_object::Save::Response &res)
 ~PointCloudPub ()

Public Attributes

UI::UI ui

Protected Attributes

sensor_msgs::PointCloud2::ConstPtr cloud_msg
pcl::PointCloud< pcl::PointXYZ > cloud_plane_
pcl::PointCloud< pcl::PointXYZRGB > cloud_xyz_rgb
pcl::PointCloud< pcl::PointXYZRGB > cloud_xyz_rgb2
pcl::ModelCoefficients coefficients
pcl::PointIndices inliers
bool new_plane_coeff
ros::NodeHandle nh_
sensor_msgs::PointCloud2::ConstPtr ptcloud2_xyz_rgb
ros::Publisher pub_object_
ros::Publisher pub_region_
pcl::SACSegmentation
< pcl::PointXYZRGB > 
seg
bool transform_pts
std::string transform_pts_frame_id

Detailed Description

Definition at line 317 of file segment_object_node.cpp.


Constructor & Destructor Documentation

Definition at line 351 of file segment_object_node.cpp.

Definition at line 380 of file segment_object_node.cpp.


Member Function Documentation

sensor_msgs::PointCloud2 PointCloudPub::cloud_callback ( const sensor_msgs::PointCloud2ConstPtr &  msg)

Definition at line 470 of file segment_object_node.cpp.

bool PointCloudPub::get_cloud ( UI_segment_object::GetObject::Request &  reg,
UI_segment_object::GetObject::Response &  res 
)

Definition at line 396 of file segment_object_node.cpp.

bool PointCloudPub::get_pt ( UI_segment_object::GetPt::Request &  reg,
UI_segment_object::GetPt::Response &  res 
)

Definition at line 435 of file segment_object_node.cpp.

geometry_msgs::Point PointCloudPub::pt_callback ( const sensor_msgs::PointCloud2ConstPtr &  msg)

Definition at line 451 of file segment_object_node.cpp.

void PointCloudPub::publish_object ( const sensor_msgs::PointCloud2 &  msg)

Definition at line 390 of file segment_object_node.cpp.

void PointCloudPub::publish_region ( const sensor_msgs::PointCloud2 &  msg)

Definition at line 385 of file segment_object_node.cpp.

bool PointCloudPub::reset_plane_coeff ( UI_segment_object::None_Bool::Request &  reg,
UI_segment_object::None_Bool::Response &  res 
)

Definition at line 426 of file segment_object_node.cpp.

bool PointCloudPub::save_cloud ( UI_segment_object::Save::Request &  reg,
UI_segment_object::Save::Response &  res 
)

Definition at line 416 of file segment_object_node.cpp.


Member Data Documentation

sensor_msgs::PointCloud2::ConstPtr PointCloudPub::cloud_msg [protected]

Definition at line 341 of file segment_object_node.cpp.

pcl::PointCloud<pcl::PointXYZ> PointCloudPub::cloud_plane_ [protected]

Definition at line 338 of file segment_object_node.cpp.

pcl::PointCloud<pcl::PointXYZRGB> PointCloudPub::cloud_xyz_rgb [protected]

Definition at line 339 of file segment_object_node.cpp.

pcl::PointCloud<pcl::PointXYZRGB> PointCloudPub::cloud_xyz_rgb2 [protected]

Definition at line 340 of file segment_object_node.cpp.

Definition at line 343 of file segment_object_node.cpp.

Definition at line 345 of file segment_object_node.cpp.

Definition at line 346 of file segment_object_node.cpp.

Definition at line 335 of file segment_object_node.cpp.

sensor_msgs::PointCloud2::ConstPtr PointCloudPub::ptcloud2_xyz_rgb [protected]

Definition at line 342 of file segment_object_node.cpp.

Definition at line 337 of file segment_object_node.cpp.

Definition at line 336 of file segment_object_node.cpp.

pcl::SACSegmentation<pcl::PointXYZRGB> PointCloudPub::seg [protected]

Definition at line 344 of file segment_object_node.cpp.

Definition at line 347 of file segment_object_node.cpp.

std::string PointCloudPub::transform_pts_frame_id [protected]

Definition at line 348 of file segment_object_node.cpp.

Definition at line 331 of file segment_object_node.cpp.


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


UI_segment_object
Author(s): Marc Killpack / mkillpack3@gatech.edu, Advisor: Prof. Charlie Kemp, Lab: Healthcare Robotics Lab at Georgia Tech
autogenerated on Wed Nov 27 2013 11:45:01