#include "tf2/time_cache.h"
#include "tf2/exceptions.h"
#include <tf2/LinearMath/Vector3.h>
#include <tf2/LinearMath/Quaternion.h>
#include <tf2/LinearMath/Transform.h>
#include <geometry_msgs/TransformStamped.h>
#include <assert.h>
Go to the source code of this file.
Functions | |
void | createExtrapolationException1 (ros::Time t0, ros::Time t1, std::string *error_str) |
void | createExtrapolationException2 (ros::Time t0, ros::Time t1, std::string *error_str) |
void | createExtrapolationException3 (ros::Time t0, ros::Time t1, std::string *error_str) |
void createExtrapolationException1 | ( | ros::Time | t0, |
ros::Time | t1, | ||
std::string * | error_str | ||
) |
void createExtrapolationException2 | ( | ros::Time | t0, |
ros::Time | t1, | ||
std::string * | error_str | ||
) |
void createExtrapolationException3 | ( | ros::Time | t0, |
ros::Time | t1, | ||
std::string * | error_str | ||
) |