#include <gtest/gtest.h>
#include <tf2/time_cache.h>
#include "tf2/LinearMath/Quaternion.h"
#include <stdexcept>
#include <geometry_msgs/TransformStamped.h>
#include <cmath>
Go to the source code of this file.
Functions | |
double | get_rand () |
int | main (int argc, char **argv) |
void | seed_rand () |
void | setIdentity (TransformStorage &stor) |
TEST (TimeCache, Repeatability) | |
TEST (TimeCache, RepeatabilityReverseInsertOrder) | |
TEST (TimeCache, ZeroAtFront) | |
TEST (TimeCache, CartesianInterpolation) | |
TEST (TimeCache, ReparentingInterpolationProtection) | |
Make sure we dont' interpolate across reparented data. More... | |
TEST (Bullet, Slerp) | |
TEST (TimeCache, AngularInterpolation) | |
TEST (TimeCache, DuplicateEntries) | |
Variables | |
unsigned int | step = 0 |
std::vector< double > | values |
double get_rand | ( | ) |
Definition at line 54 of file cache_unittest.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 410 of file cache_unittest.cpp.
void seed_rand | ( | ) |
Definition at line 42 of file cache_unittest.cpp.
void setIdentity | ( | TransformStorage & | stor | ) |
Definition at line 67 of file cache_unittest.cpp.
TEST | ( | TimeCache | , |
Repeatability | |||
) |
Definition at line 73 of file cache_unittest.cpp.
TEST | ( | TimeCache | , |
RepeatabilityReverseInsertOrder | |||
) |
Definition at line 100 of file cache_unittest.cpp.
TEST | ( | TimeCache | , |
ZeroAtFront | |||
) |
Definition at line 164 of file cache_unittest.cpp.
TEST | ( | TimeCache | , |
CartesianInterpolation | |||
) |
Definition at line 209 of file cache_unittest.cpp.
TEST | ( | TimeCache | , |
ReparentingInterpolationProtection | |||
) |
Make sure we dont' interpolate across reparented data.
Definition at line 266 of file cache_unittest.cpp.
TEST | ( | Bullet | , |
Slerp | |||
) |
Definition at line 305 of file cache_unittest.cpp.
TEST | ( | TimeCache | , |
AngularInterpolation | |||
) |
Definition at line 329 of file cache_unittest.cpp.
TEST | ( | TimeCache | , |
DuplicateEntries | |||
) |
Definition at line 383 of file cache_unittest.cpp.
unsigned int step = 0 |
Definition at line 40 of file cache_unittest.cpp.
std::vector<double> values |
Definition at line 39 of file cache_unittest.cpp.