#include <opencv2/core/core.hpp>
#include <geometry_msgs/Point.h>
#include <calibration_msgs/DenseLaserSnapshot.h>
Go to the source code of this file.
Classes | |
class | laser_joint_processor::JointImageInterpolator |
Namespaces | |
namespace | laser_joint_processor |
Functions | |
bool | laser_joint_processor::interpSnapshot (const std::vector< geometry_msgs::Point > &points, const calibration_msgs::DenseLaserSnapshot &snapshot, std::vector< float > &pointing_angles, std::vector< float > &ranges) |