37 #ifndef LASER_JOINT_PROCESSOR_INTERP_FEATURES_H_ 38 #define LASER_JOINT_PROCESSOR_INTERP_FEATURES_H_ 40 #include <opencv2/core/core.hpp> 41 #include <geometry_msgs/Point.h> 42 #include <calibration_msgs/DenseLaserSnapshot.h> 50 bool interp(
const std::vector<geometry_msgs::Point>& points,
51 cv::Mat_<cv::Vec2f> image, std::vector<float>& positions, std::vector<float>& velocities);
56 bool interpSnapshot(
const std::vector<geometry_msgs::Point>& points,
57 const calibration_msgs::DenseLaserSnapshot& snapshot,
58 std::vector<float>& pointing_angles,
59 std::vector<float>& ranges);
63 #endif // LASER_JOINT_PROCESSOR_INTERP_FEATURES_H_ bool interpSnapshot(const std::vector< geometry_msgs::Point > &points, const calibration_msgs::DenseLaserSnapshot &snapshot, std::vector< float > &pointing_angles, std::vector< float > &ranges)
bool interp(const std::vector< geometry_msgs::Point > &points, cv::Mat_< cv::Vec2f > image, std::vector< float > &positions, std::vector< float > &velocities)