#include <math.h>
#include <pluginlib/class_list_macros.h>
#include <robot_calibration/capture/led_finder.h>
#include <sensor_msgs/point_cloud2_iterator.h>
#include <sensor_msgs/image_encodings.h>
Go to the source code of this file.
Namespaces | |
robot_calibration | |
Calibration code lives under this namespace. | |
Functions | |
double | robot_calibration::distancePoints (const geometry_msgs::Point p1, const geometry_msgs::Point p2) |
Variables | |
const unsigned | robot_calibration::B = 2 |
const unsigned | robot_calibration::G = 1 |
const unsigned | robot_calibration::R = 0 |