#include <fiducial_slam/helpers.h>
#include <fiducial_slam/map.h>
#include <tf2/LinearMath/Quaternion.h>
#include <tf2/LinearMath/Vector3.h>
#include <string>
#include <std_msgs/ColorRGBA.h>
#include <std_msgs/String.h>
#include <geometry_msgs/Point.h>
#include <geometry_msgs/PoseWithCovarianceStamped.h>
#include <geometry_msgs/TransformStamped.h>
#include <visualization_msgs/Marker.h>
#include <boost/filesystem.hpp>
Go to the source code of this file.
static int findClosestObs |
( |
const std::vector< Observation > & |
obs | ) |
|
|
static |
double systematic_error = 0.01 |
|
static |