#include <ShapeReconstruction.h>
Public Member Functions | |
FrameForSegmentation | clone () const |
FrameForSegmentation () | |
void | reset () |
Public Attributes | |
cv_bridge::CvImagePtr | _dm |
cv::Mat | _dm_filled |
std::vector< int > | _not_nan_indices |
SRPointCloud::Ptr | _pc |
SRPointCloud::Ptr | _pc_moving_pts |
SRPointCloud::Ptr | _pc_moving_pts_transf |
SRPointCloud::Ptr | _pc_without_nans |
sensor_msgs::Image | _rgb |
ros::Time | _time |
geometry_msgs::TwistWithCovariance | _transformation |
Definition at line 99 of file ShapeReconstruction.h.
omip::FrameForSegmentation::FrameForSegmentation | ( | ) | [inline] |
Definition at line 112 of file ShapeReconstruction.h.
FrameForSegmentation omip::FrameForSegmentation::clone | ( | ) | const [inline] |
Definition at line 144 of file ShapeReconstruction.h.
void omip::FrameForSegmentation::reset | ( | ) | [inline] |
Definition at line 128 of file ShapeReconstruction.h.
Definition at line 108 of file ShapeReconstruction.h.
Definition at line 109 of file ShapeReconstruction.h.
std::vector<int> omip::FrameForSegmentation::_not_nan_indices |
Definition at line 106 of file ShapeReconstruction.h.
SRPointCloud::Ptr omip::FrameForSegmentation::_pc |
Definition at line 102 of file ShapeReconstruction.h.
SRPointCloud::Ptr omip::FrameForSegmentation::_pc_moving_pts |
Definition at line 103 of file ShapeReconstruction.h.
SRPointCloud::Ptr omip::FrameForSegmentation::_pc_moving_pts_transf |
Definition at line 104 of file ShapeReconstruction.h.
SRPointCloud::Ptr omip::FrameForSegmentation::_pc_without_nans |
Definition at line 105 of file ShapeReconstruction.h.
sensor_msgs::Image omip::FrameForSegmentation::_rgb |
Definition at line 107 of file ShapeReconstruction.h.
Definition at line 101 of file ShapeReconstruction.h.
geometry_msgs::TwistWithCovariance omip::FrameForSegmentation::_transformation |
Definition at line 110 of file ShapeReconstruction.h.