#include <gtest/gtest.h>
#include <tf2/time_cache.h>
#include <sys/time.h>
#include "LinearMath/btVector3.h"
#include "LinearMath/btMatrix3x3.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, DuplicateEntries) | |
TEST (TimeCache, AngularInterpolation) | |
TEST (Bullet, Slerp) | |
TEST (TimeCache, ReparentingInterpolationProtection) | |
Make sure we dont' interpolate across reparented data. | |
TEST (TimeCache, CartesianInterpolation) | |
TEST (TimeCache, ZeroAtFront) | |
TEST (TimeCache, RepeatabilityReverseInsertOrder) | |
TEST (TimeCache, Repeatability) | |
Variables | |
unsigned int | step = 0 |
std::vector< double > | values |
double get_rand | ( | ) |
Definition at line 56 of file cache_unittest.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 406 of file cache_unittest.cpp.
void seed_rand | ( | ) |
Definition at line 44 of file cache_unittest.cpp.
void setIdentity | ( | TransformStorage & | stor | ) |
Definition at line 69 of file cache_unittest.cpp.
TEST | ( | TimeCache | , | |
DuplicateEntries | ||||
) |
Definition at line 379 of file cache_unittest.cpp.
TEST | ( | TimeCache | , | |
AngularInterpolation | ||||
) |
Definition at line 328 of file cache_unittest.cpp.
TEST | ( | Bullet | , | |
Slerp | ||||
) |
Definition at line 304 of file cache_unittest.cpp.
TEST | ( | TimeCache | , | |
ReparentingInterpolationProtection | ||||
) |
Make sure we dont' interpolate across reparented data.
Definition at line 265 of file cache_unittest.cpp.
TEST | ( | TimeCache | , | |
CartesianInterpolation | ||||
) |
Definition at line 211 of file cache_unittest.cpp.
TEST | ( | TimeCache | , | |
ZeroAtFront | ||||
) |
Definition at line 166 of file cache_unittest.cpp.
TEST | ( | TimeCache | , | |
RepeatabilityReverseInsertOrder | ||||
) |
Definition at line 102 of file cache_unittest.cpp.
TEST | ( | TimeCache | , | |
Repeatability | ||||
) |
Definition at line 75 of file cache_unittest.cpp.
unsigned int step = 0 |
Definition at line 42 of file cache_unittest.cpp.
std::vector<double> values |
Definition at line 41 of file cache_unittest.cpp.