#include <ros/ros.h>
#include <robot_calibration/plugins/feature_finder.h>
#include <robot_calibration_msgs/CalibrationData.h>
#include <sensor_msgs/LaserScan.h>
#include <tf2_ros/transform_listener.h>
Go to the source code of this file.
Classes | |
class | robot_calibration::ScanFinder |
The scan finder is useful for aligning a laser scanner with other sensors. In particular, the laser scan be multiplied in the Z direction in order to create a plane for plane to plane calibration. More... | |
Namespaces | |
robot_calibration | |
Calibration code lives under this namespace. | |