Functions | Variables
test_tomsg_frommsg.cpp File Reference
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
#include <gtest/gtest.h>
Include dependency graph for test_tomsg_frommsg.cpp:

Go to the source code of this file.

Functions

void expect_near (const std_msgs::Header &h1, const std_msgs::Header &h2)
 
void expect_near (const geometry_msgs::Vector3 &v1, const tf2::Vector3 &v2)
 
void expect_near (const geometry_msgs::Vector3 &v1, const geometry_msgs::Vector3 &v2)
 
void expect_near (const tf2::Vector3 &v1, const tf2::Vector3 &v2)
 
void expect_near (const geometry_msgs::Vector3Stamped &p1, const geometry_msgs::Vector3Stamped &p2)
 
void expect_near (const geometry_msgs::Point &p1, const tf2::Vector3 &v2)
 
void expect_near (const geometry_msgs::Point &p1, const geometry_msgs::Point &v2)
 
void expect_near (const geometry_msgs::PointStamped &p1, const geometry_msgs::PointStamped &p2)
 
void expect_near (const geometry_msgs::Quaternion &q1, const tf2::Quaternion &v2)
 
void expect_near (const geometry_msgs::Quaternion &q1, const geometry_msgs::Quaternion &v2)
 
void expect_near (const geometry_msgs::QuaternionStamped &p1, const geometry_msgs::QuaternionStamped &p2)
 
void expect_near (const geometry_msgs::Pose &p, const tf2::Transform &t)
 
void expect_near (const geometry_msgs::Pose &p1, const geometry_msgs::Pose &p2)
 
void expect_near (const geometry_msgs::PoseStamped &p1, const geometry_msgs::PoseStamped &p2)
 
void expect_near (const geometry_msgs::Transform &p, const tf2::Transform &t)
 
void expect_near (const geometry_msgs::Transform &p1, const geometry_msgs::Transform &p2)
 
void expect_near (const geometry_msgs::TransformStamped &p1, const geometry_msgs::TransformStamped &p2)
 
template<typename T >
void expect_near (const tf2::Stamped< T > &s1, const tf2::Stamped< T > &s2)
 
tf2::Vector3 get_tf2_vector ()
 
int main (int argc, char **argv)
 
 TEST (tf2_geometry_msgs, Vector3)
 
 TEST (tf2_geometry_msgs, Point)
 
 TEST (tf2_geometry_msgs, Quaternion)
 
 TEST (tf2_geometry_msgs, Pose)
 
 TEST (tf2_geometry_msgs, Transform)
 
 TEST (tf2_geometry_msgs, Vector3Stamped)
 
 TEST (tf2_geometry_msgs, PointStamped)
 
 TEST (tf2_geometry_msgs, QuaternionStamped)
 
 TEST (tf2_geometry_msgs, PoseStamped)
 
 TEST (tf2_geometry_msgs, TransformStamped)
 
geometry_msgs::Vector3 & value_initialize (geometry_msgs::Vector3 &m1)
 
std_msgs::Headervalue_initialize (std_msgs::Header &h)
 
geometry_msgs::Vector3Stamped & value_initialize (geometry_msgs::Vector3Stamped &m1)
 
geometry_msgs::Point & value_initialize (geometry_msgs::Point &m1)
 
geometry_msgs::PointStamped & value_initialize (geometry_msgs::PointStamped &m1)
 
geometry_msgs::Quaternion & value_initialize (geometry_msgs::Quaternion &m1)
 
geometry_msgs::QuaternionStamped & value_initialize (geometry_msgs::QuaternionStamped &m1)
 
geometry_msgs::Pose & value_initialize (geometry_msgs::Pose &m1)
 
geometry_msgs::PoseStamped & value_initialize (geometry_msgs::PoseStamped &m1)
 
geometry_msgs::Transform & value_initialize (geometry_msgs::Transform &m1)
 
geometry_msgs::TransformStamped & value_initialize (geometry_msgs::TransformStamped &m1)
 

Variables

static const double EPS = 1e-6
 

Function Documentation

void expect_near ( const std_msgs::Header h1,
const std_msgs::Header h2 
)

Definition at line 124 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Vector3 &  v1,
const tf2::Vector3 &  v2 
)

Definition at line 133 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Vector3 &  v1,
const geometry_msgs::Vector3 &  v2 
)

Definition at line 140 of file test_tomsg_frommsg.cpp.

void expect_near ( const tf2::Vector3 &  v1,
const tf2::Vector3 &  v2 
)

Definition at line 147 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Vector3Stamped &  p1,
const geometry_msgs::Vector3Stamped &  p2 
)

Definition at line 154 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Point &  p1,
const tf2::Vector3 &  v2 
)

Definition at line 163 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Point &  p1,
const geometry_msgs::Point &  v2 
)

Definition at line 170 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::PointStamped &  p1,
const geometry_msgs::PointStamped &  p2 
)

Definition at line 177 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Quaternion &  q1,
const tf2::Quaternion v2 
)

Definition at line 187 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Quaternion &  q1,
const geometry_msgs::Quaternion &  v2 
)

Definition at line 194 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::QuaternionStamped &  p1,
const geometry_msgs::QuaternionStamped &  p2 
)

Definition at line 201 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Pose &  p,
const tf2::Transform t 
)

Definition at line 210 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Pose &  p1,
const geometry_msgs::Pose &  p2 
)

Definition at line 216 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::PoseStamped &  p1,
const geometry_msgs::PoseStamped &  p2 
)

Definition at line 222 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Transform &  p,
const tf2::Transform t 
)

Definition at line 231 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::Transform &  p1,
const geometry_msgs::Transform &  p2 
)

Definition at line 237 of file test_tomsg_frommsg.cpp.

void expect_near ( const geometry_msgs::TransformStamped &  p1,
const geometry_msgs::TransformStamped &  p2 
)

Definition at line 243 of file test_tomsg_frommsg.cpp.

template<typename T >
void expect_near ( const tf2::Stamped< T > &  s1,
const tf2::Stamped< T > &  s2 
)

Definition at line 254 of file test_tomsg_frommsg.cpp.

tf2::Vector3 get_tf2_vector ( )

Definition at line 38 of file test_tomsg_frommsg.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 401 of file test_tomsg_frommsg.cpp.

TEST ( tf2_geometry_msgs  ,
Vector3   
)

Definition at line 263 of file test_tomsg_frommsg.cpp.

TEST ( tf2_geometry_msgs  ,
Point   
)

Definition at line 276 of file test_tomsg_frommsg.cpp.

TEST ( tf2_geometry_msgs  ,
Quaternion   
)

Definition at line 289 of file test_tomsg_frommsg.cpp.

TEST ( tf2_geometry_msgs  ,
Pose   
)

Definition at line 302 of file test_tomsg_frommsg.cpp.

TEST ( tf2_geometry_msgs  ,
Transform   
)

Definition at line 315 of file test_tomsg_frommsg.cpp.

TEST ( tf2_geometry_msgs  ,
Vector3Stamped   
)

Definition at line 328 of file test_tomsg_frommsg.cpp.

TEST ( tf2_geometry_msgs  ,
PointStamped   
)

Definition at line 342 of file test_tomsg_frommsg.cpp.

TEST ( tf2_geometry_msgs  ,
QuaternionStamped   
)

Definition at line 356 of file test_tomsg_frommsg.cpp.

TEST ( tf2_geometry_msgs  ,
PoseStamped   
)

Definition at line 370 of file test_tomsg_frommsg.cpp.

TEST ( tf2_geometry_msgs  ,
TransformStamped   
)

Definition at line 384 of file test_tomsg_frommsg.cpp.

geometry_msgs::Vector3& value_initialize ( geometry_msgs::Vector3 &  m1)

Definition at line 43 of file test_tomsg_frommsg.cpp.

std_msgs::Header& value_initialize ( std_msgs::Header h)

Definition at line 51 of file test_tomsg_frommsg.cpp.

geometry_msgs::Vector3Stamped& value_initialize ( geometry_msgs::Vector3Stamped &  m1)

Definition at line 58 of file test_tomsg_frommsg.cpp.

geometry_msgs::Point& value_initialize ( geometry_msgs::Point &  m1)

Definition at line 65 of file test_tomsg_frommsg.cpp.

geometry_msgs::PointStamped& value_initialize ( geometry_msgs::PointStamped &  m1)

Definition at line 73 of file test_tomsg_frommsg.cpp.

geometry_msgs::Quaternion& value_initialize ( geometry_msgs::Quaternion &  m1)

Definition at line 80 of file test_tomsg_frommsg.cpp.

geometry_msgs::QuaternionStamped& value_initialize ( geometry_msgs::QuaternionStamped &  m1)

Definition at line 89 of file test_tomsg_frommsg.cpp.

geometry_msgs::Pose& value_initialize ( geometry_msgs::Pose &  m1)

Definition at line 96 of file test_tomsg_frommsg.cpp.

geometry_msgs::PoseStamped& value_initialize ( geometry_msgs::PoseStamped &  m1)

Definition at line 103 of file test_tomsg_frommsg.cpp.

geometry_msgs::Transform& value_initialize ( geometry_msgs::Transform &  m1)

Definition at line 110 of file test_tomsg_frommsg.cpp.

geometry_msgs::TransformStamped& value_initialize ( geometry_msgs::TransformStamped &  m1)

Definition at line 117 of file test_tomsg_frommsg.cpp.

Variable Documentation

const double EPS = 1e-6
static
Author
Wim Meeussen

Definition at line 36 of file test_tomsg_frommsg.cpp.



tf2_geometry_msgs
Author(s): Wim Meeussen
autogenerated on Fri Oct 16 2020 19:08:59