Functions
test_imu_transforms.cpp File Reference
#include "gtest/gtest.h"
#include <imu_transformer/tf2_sensor_msgs.h>
#include <sensor_msgs/Imu.h>
#include <sensor_msgs/MagneticField.h>
#include <tf2/LinearMath/Quaternion.h>
#include <tf2_geometry_msgs/tf2_geometry_msgs.h>
Include dependency graph for test_imu_transforms.cpp:

Go to the source code of this file.

Functions

void compareCovariances (const boost::array< double, 9 > &c1, const boost::array< double, 9 > &c2)
 
int main (int argc, char **argv)
 
void prepareImuMsg (sensor_msgs::Imu &msg)
 
void prepareMagMsg (sensor_msgs::MagneticField &msg)
 
void prepareTf (geometry_msgs::TransformStamped &tf)
 
 TEST (Covariance, Transform)
 
 TEST (Imu, GetTimestamp)
 
 TEST (Imu, GetFrameId)
 
 TEST (Imu, DoTransformYaw)
 
 TEST (Imu, DoTransformEnuNed)
 
 TEST (Mag, GetTimestamp)
 
 TEST (Mag, GetFrameId)
 
 TEST (Mag, DoTransformYaw)
 
 TEST (Mag, DoTransformEnuNed)
 

Detailed Description

Author
Martin Pecka SPDX-License-Identifier: BSD-3-Clause SPDX-FileCopyrightText: Czech Technical University in Prague

Definition in file test_imu_transforms.cpp.

Function Documentation

◆ compareCovariances()

void compareCovariances ( const boost::array< double, 9 > &  c1,
const boost::array< double, 9 > &  c2 
)

Definition at line 17 of file test_imu_transforms.cpp.

◆ main()

int main ( int  argc,
char **  argv 
)

Definition at line 271 of file test_imu_transforms.cpp.

◆ prepareImuMsg()

void prepareImuMsg ( sensor_msgs::Imu &  msg)

Definition at line 87 of file test_imu_transforms.cpp.

◆ prepareMagMsg()

void prepareMagMsg ( sensor_msgs::MagneticField &  msg)

Definition at line 209 of file test_imu_transforms.cpp.

◆ prepareTf()

void prepareTf ( geometry_msgs::TransformStamped &  tf)

Definition at line 103 of file test_imu_transforms.cpp.

◆ TEST() [1/9]

TEST ( Covariance  ,
Transform   
)

Definition at line 23 of file test_imu_transforms.cpp.

◆ TEST() [2/9]

TEST ( Imu  ,
GetTimestamp   
)

Definition at line 70 of file test_imu_transforms.cpp.

◆ TEST() [3/9]

TEST ( Imu  ,
GetFrameId   
)

Definition at line 79 of file test_imu_transforms.cpp.

◆ TEST() [4/9]

TEST ( Imu  ,
DoTransformYaw   
)

Definition at line 114 of file test_imu_transforms.cpp.

◆ TEST() [5/9]

TEST ( Imu  ,
DoTransformEnuNed   
)

Definition at line 153 of file test_imu_transforms.cpp.

◆ TEST() [6/9]

TEST ( Mag  ,
GetTimestamp   
)

Definition at line 192 of file test_imu_transforms.cpp.

◆ TEST() [7/9]

TEST ( Mag  ,
GetFrameId   
)

Definition at line 201 of file test_imu_transforms.cpp.

◆ TEST() [8/9]

TEST ( Mag  ,
DoTransformYaw   
)

Definition at line 219 of file test_imu_transforms.cpp.

◆ TEST() [9/9]

TEST ( Mag  ,
DoTransformEnuNed   
)

Definition at line 245 of file test_imu_transforms.cpp.



imu_transformer
Author(s): Paul Bovbel
autogenerated on Fri Nov 25 2022 03:51:09