Classes | |
| class | Beam |
| class | Corner |
| class | Line |
| class | LineEq |
| class | LineSegment |
| class | Measurment |
| class | Pose |
Functions | |
| void | copy (const sensor_msgs::LaserScan &_msg, std::vector< Measurment > &_desMeasurments, std::vector< Beam > &_desBeams) |
| float | dot (const cv::Vec3f &l1, const cv::Point2f &p) |
| void | intersection (const cv::Vec3f &l1, const cv::Vec3f &l2, cv::Point2f &p) |
| void | readScan (const std::string &filename, sensor_msgs::LaserScan &msg) |
| void | writeScan (const std::string &filename, const sensor_msgs::LaserScan &msg) |
| void LaserFilter::copy | ( | const sensor_msgs::LaserScan & | _msg, |
| std::vector< Measurment > & | _desMeasurments, | ||
| std::vector< Beam > & | _desBeams | ||
| ) |
Definition at line 318 of file v4r_laser_filter_utils.cpp.
| float LaserFilter::dot | ( | const cv::Vec3f & | l1, |
| const cv::Point2f & | p | ||
| ) |
Definition at line 336 of file v4r_laser_filter_utils.cpp.
| void LaserFilter::intersection | ( | const cv::Vec3f & | l1, |
| const cv::Vec3f & | l2, | ||
| cv::Point2f & | p | ||
| ) |
Definition at line 332 of file v4r_laser_filter_utils.cpp.
| void LaserFilter::readScan | ( | const std::string & | filename, |
| sensor_msgs::LaserScan & | msg | ||
| ) |
Definition at line 340 of file v4r_laser_filter_utils.cpp.
| void LaserFilter::writeScan | ( | const std::string & | filename, |
| const sensor_msgs::LaserScan & | msg | ||
| ) |
Definition at line 355 of file v4r_laser_filter_utils.cpp.