#include "tf/time_cache.h"#include "tf/exceptions.h"#include "tf/LinearMath/Transform.h"#include <geometry_msgs/TransformStamped.h>#include "ros/assert.h"
Go to the source code of this file.
Functions | |
| void | createEmptyException (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) |
| void createEmptyException | ( | 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 | ||
| ) |