tf_unittest.cpp File Reference

#include <gtest/gtest.h>
#include <tf/tf.h>
#include <sys/time.h>
#include <ros/ros.h>
#include "LinearMath/btVector3.h"
Include dependency graph for tf_unittest.cpp:

Go to the source code of this file.

Functions

bool expectInvalidQuaternion (geometry_msgs::Quaternion q)
bool expectInvalidQuaternion (tf::Quaternion q)
bool expectValidQuaternion (geometry_msgs::Quaternion q)
bool expectValidQuaternion (tf::Quaternion q)
void generate_rand_vectors (double scale, uint64_t runs, std::vector< double > &xvalues, std::vector< double > &yvalues, std::vector< double > &zvalues)
int main (int argc, char **argv)
void seed_rand ()
 TEST (data, StampedOperatorEqual)
 TEST (data, StampedTransformOperatorEqualEqual)
 TEST (data, StampedOperatorEqualEqual)
 TEST (tf, assertQuaternionMsgValid)
 TEST (tf, assertQuaternionValid)
 TEST (tf, getFrameStrings)
 TEST (tf, lookupTransform)
 TEST (tf, canTransform)
 TEST (tf, resolve)
 TEST (tf, frameExists)
 TEST (tf, RepeatedTimes)
 TEST (tf, getLatestCommonTime)
 TEST (tf, ExtrapolationFromOneValue)
 TEST (tf, NoExtrapolationExceptionFromParent)
 TEST (tf, Exceptions)
 TEST (tf, waitForTransform)
 TEST (tf, NO_PARENT_SET)
 TEST (tf, getParent)
 TEST (tf, TransformThroughNO_PARENT)
 TEST (tf, TransformThrougRoot)
 TEST (tf, ListTwoForward)
 TEST (tf, ListOneForward)
 TEST (tf, ListTwoInverse)
 TEST (tf, ListOneInverse)
 TEST (data, PoseStampedConversions)
 TEST (data, TransformConversions)
 TEST (data, QuaternionStampedConversions)
 TEST (data, QuaternionConversions)
 TEST (data, Vector3StampedConversions)
 TEST (data, Vector3Conversions)
 TEST (tf, TransformQuaternionCartesian)
 TEST (tf, TransformVectorCartesian)
 TEST (tf, TransformPointCartesian)
 TEST (tf, TransformTransformToOwnFrame)
 TEST (tf, TransformTransformsCartesian)
 TEST (tf, setTransformNoInsertWithNoParentID)
 TEST (tf, setTransformNoInsertWithNoFrameID)
 TEST (tf, setTransformNoInsertWithNan)
 TEST (tf, setTransformNoInsertOnSelfTransform)

Function Documentation

bool expectInvalidQuaternion ( geometry_msgs::Quaternion  q  ) 

Definition at line 1704 of file tf_unittest.cpp.

bool expectInvalidQuaternion ( tf::Quaternion  q  ) 

Definition at line 1671 of file tf_unittest.cpp.

bool expectValidQuaternion ( geometry_msgs::Quaternion  q  ) 

Definition at line 1724 of file tf_unittest.cpp.

bool expectValidQuaternion ( tf::Quaternion  q  ) 

Definition at line 1691 of file tf_unittest.cpp.

void generate_rand_vectors ( double  scale,
uint64_t  runs,
std::vector< double > &  xvalues,
std::vector< double > &  yvalues,
std::vector< double > &  zvalues 
)

Definition at line 44 of file tf_unittest.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 1900 of file tf_unittest.cpp.

void seed_rand (  ) 

Definition at line 36 of file tf_unittest.cpp.

TEST ( data  ,
StampedOperatorEqual   
)

Definition at line 1886 of file tf_unittest.cpp.

TEST ( data  ,
StampedTransformOperatorEqualEqual   
)

Definition at line 1840 of file tf_unittest.cpp.

TEST ( data  ,
StampedOperatorEqualEqual   
)

Definition at line 1813 of file tf_unittest.cpp.

TEST ( tf  ,
assertQuaternionMsgValid   
)

Definition at line 1774 of file tf_unittest.cpp.

TEST ( tf  ,
assertQuaternionValid   
)

Definition at line 1738 of file tf_unittest.cpp.

TEST ( tf  ,
getFrameStrings   
)

Definition at line 1647 of file tf_unittest.cpp.

TEST ( tf  ,
lookupTransform   
)

Definition at line 1467 of file tf_unittest.cpp.

TEST ( tf  ,
canTransform   
)

Definition at line 1371 of file tf_unittest.cpp.

TEST ( tf  ,
resolve   
)

Definition at line 1356 of file tf_unittest.cpp.

TEST ( tf  ,
frameExists   
)

Definition at line 1310 of file tf_unittest.cpp.

TEST ( tf  ,
RepeatedTimes   
)

Definition at line 1285 of file tf_unittest.cpp.

TEST ( tf  ,
getLatestCommonTime   
)

Definition at line 1204 of file tf_unittest.cpp.

TEST ( tf  ,
ExtrapolationFromOneValue   
)

Definition at line 1121 of file tf_unittest.cpp.

TEST ( tf  ,
NoExtrapolationExceptionFromParent   
)

Definition at line 1085 of file tf_unittest.cpp.

TEST ( tf  ,
Exceptions   
)

Definition at line 921 of file tf_unittest.cpp.

TEST ( tf  ,
waitForTransform   
)

Definition at line 867 of file tf_unittest.cpp.

TEST ( tf  ,
NO_PARENT_SET   
)

Definition at line 832 of file tf_unittest.cpp.

TEST ( tf  ,
getParent   
)

Definition at line 784 of file tf_unittest.cpp.

TEST ( tf  ,
TransformThroughNO_PARENT   
)

Definition at line 737 of file tf_unittest.cpp.

TEST ( tf  ,
TransformThrougRoot   
)

Definition at line 691 of file tf_unittest.cpp.

TEST ( tf  ,
ListTwoForward   
)

Definition at line 645 of file tf_unittest.cpp.

TEST ( tf  ,
ListOneForward   
)

Definition at line 601 of file tf_unittest.cpp.

TEST ( tf  ,
ListTwoInverse   
)

Definition at line 554 of file tf_unittest.cpp.

TEST ( tf  ,
ListOneInverse   
)

Definition at line 510 of file tf_unittest.cpp.

TEST ( data  ,
PoseStampedConversions   
)

Definition at line 480 of file tf_unittest.cpp.

TEST ( data  ,
TransformConversions   
)

Definition at line 451 of file tf_unittest.cpp.

TEST ( data  ,
QuaternionStampedConversions   
)

Definition at line 426 of file tf_unittest.cpp.

TEST ( data  ,
QuaternionConversions   
)

Definition at line 402 of file tf_unittest.cpp.

TEST ( data  ,
Vector3StampedConversions   
)

Definition at line 378 of file tf_unittest.cpp.

TEST ( data  ,
Vector3Conversions   
)

Definition at line 355 of file tf_unittest.cpp.

TEST ( tf  ,
TransformQuaternionCartesian   
)

Definition at line 310 of file tf_unittest.cpp.

TEST ( tf  ,
TransformVectorCartesian   
)

Definition at line 262 of file tf_unittest.cpp.

TEST ( tf  ,
TransformPointCartesian   
)

Definition at line 214 of file tf_unittest.cpp.

TEST ( tf  ,
TransformTransformToOwnFrame   
)

Make sure that the edge cases of transform the top of the tree to the top of the tree and the leaf of the tree can transform to the leaf of the tree without a lookup exception and accurately

Definition at line 147 of file tf_unittest.cpp.

TEST ( tf  ,
TransformTransformsCartesian   
)

Definition at line 91 of file tf_unittest.cpp.

TEST ( tf  ,
setTransformNoInsertWithNoParentID   
)

Definition at line 84 of file tf_unittest.cpp.

TEST ( tf  ,
setTransformNoInsertWithNoFrameID   
)

Definition at line 77 of file tf_unittest.cpp.

TEST ( tf  ,
setTransformNoInsertWithNan   
)

Definition at line 65 of file tf_unittest.cpp.

TEST ( tf  ,
setTransformNoInsertOnSelfTransform   
)

Definition at line 58 of file tf_unittest.cpp.

 All Classes Namespaces Files Functions Variables Typedefs Enumerations Enumerator Defines


tf
Author(s): Tully Foote, Eitan Marder-Eppstein, Wim Meeussen
autogenerated on Fri Jan 11 09:09:53 2013