| Classes | |
| class | MedianFilter | 
| struct | PlaneFitResult | 
| Typedefs | |
| typedef pcl::PointCloud< ARPoint > | ARCloud | 
| typedef pcl::PointXYZRGB | ARPoint | 
| Functions | |
| geometry_msgs::Point | centroid (const ARCloud &points) | 
| int | extractFrame (const pcl::ModelCoefficients &coeffs, const ARPoint &p1, const ARPoint &p2, const ARPoint &p3, const ARPoint &p4, tf::Matrix3x3 &retmat) | 
| int | extractOrientation (const pcl::ModelCoefficients &coeffs, const ARPoint &p1, const ARPoint &p2, const ARPoint &p3, const ARPoint &p4, geometry_msgs::Quaternion &retQ) | 
| int | extractOrientation (const pcl::ModelCoefficients &coeffs, const ARPoint &p1, const ARPoint &p2, const ARPoint &p3, const ARPoint &p4, gm::Quaternion &retQ) | 
| ARCloud::Ptr | filterCloud (const ARCloud &cloud, const vector< cv::Point, Eigen::aligned_allocator< cv::Point > > &pixels) | 
| ARCloud::Ptr | filterCloud (const ARCloud &cloud, const std::vector< cv::Point, Eigen::aligned_allocator< cv::Point > > &pixels) | 
| PlaneFitResult | fitPlane (ARCloud::ConstPtr cloud) | 
| int | getCoeffs (const pcl::ModelCoefficients &coeffs, double *a, double *b, double *c, double *d) | 
| int | getQuaternion (const tf::Matrix3x3 &m, tf::Quaternion &retQ) | 
| gm::Quaternion | makeQuaternion (double x, double y, double z, double w) | 
| ostream & | operator<< (ostream &str, const tf::Matrix3x3 &m) | 
| ostream & | operator<< (ostream &str, const tf::Quaternion &q) | 
| ostream & | operator<< (ostream &str, const tf::Vector3 &v) | 
| tf::Vector3 | project (const ARPoint &p, const double a, const double b, const double c, const double d) | 
| Variables | |
| const double | distance_threshold_ = 0.005 | 
Definition at line 67 of file kinect_filtering.h.
| typedef pcl::PointXYZRGB ar_track_alvar::ARPoint | 
Definition at line 66 of file kinect_filtering.h.
Definition at line 96 of file kinect_filtering.cpp.
| int ar_track_alvar::extractFrame | ( | const pcl::ModelCoefficients & | coeffs, | 
| const ARPoint & | p1, | ||
| const ARPoint & | p2, | ||
| const ARPoint & | p3, | ||
| const ARPoint & | p4, | ||
| tf::Matrix3x3 & | retmat | ||
| ) | 
Definition at line 176 of file kinect_filtering.cpp.
| int ar_track_alvar::extractOrientation | ( | const pcl::ModelCoefficients & | coeffs, | 
| const ARPoint & | p1, | ||
| const ARPoint & | p2, | ||
| const ARPoint & | p3, | ||
| const ARPoint & | p4, | ||
| geometry_msgs::Quaternion & | retQ | ||
| ) | 
| int ar_track_alvar::extractOrientation | ( | const pcl::ModelCoefficients & | coeffs, | 
| const ARPoint & | p1, | ||
| const ARPoint & | p2, | ||
| const ARPoint & | p3, | ||
| const ARPoint & | p4, | ||
| gm::Quaternion & | retQ | ||
| ) | 
Definition at line 249 of file kinect_filtering.cpp.
| ARCloud::Ptr ar_track_alvar::filterCloud | ( | const ARCloud & | cloud, | 
| const vector< cv::Point, Eigen::aligned_allocator< cv::Point > > & | pixels | ||
| ) | 
Definition at line 78 of file kinect_filtering.cpp.
| ARCloud::Ptr ar_track_alvar::filterCloud | ( | const ARCloud & | cloud, | 
| const std::vector< cv::Point, Eigen::aligned_allocator< cv::Point > > & | pixels | ||
| ) | 
| PlaneFitResult ar_track_alvar::fitPlane | ( | ARCloud::ConstPtr | cloud | ) | 
Definition at line 55 of file kinect_filtering.cpp.
| int ar_track_alvar::getCoeffs | ( | const pcl::ModelCoefficients & | coeffs, | 
| double * | a, | ||
| double * | b, | ||
| double * | c, | ||
| double * | d | ||
| ) | 
Definition at line 131 of file kinect_filtering.cpp.
| int ar_track_alvar::getQuaternion | ( | const tf::Matrix3x3 & | m, | 
| tf::Quaternion & | retQ | ||
| ) | 
Definition at line 219 of file kinect_filtering.cpp.
| 
 | inline | 
Definition at line 120 of file kinect_filtering.cpp.
| ostream& ar_track_alvar::operator<< | ( | ostream & | str, | 
| const tf::Matrix3x3 & | m | ||
| ) | 
Definition at line 155 of file kinect_filtering.cpp.
| ostream& ar_track_alvar::operator<< | ( | ostream & | str, | 
| const tf::Quaternion & | q | ||
| ) | 
Definition at line 163 of file kinect_filtering.cpp.
| ostream& ar_track_alvar::operator<< | ( | ostream & | str, | 
| const tf::Vector3 & | v | ||
| ) | 
Definition at line 170 of file kinect_filtering.cpp.
| tf::Vector3 ar_track_alvar::project | ( | const ARPoint & | p, | 
| const double | a, | ||
| const double | b, | ||
| const double | c, | ||
| const double | d | ||
| ) | 
Definition at line 148 of file kinect_filtering.cpp.
| const double ar_track_alvar::distance_threshold_ = 0.005 | 
Definition at line 53 of file kinect_filtering.cpp.