#include <mrpt/poses/CPosePDFGaussian.h>
#include <mrpt/poses/CPose3DPDFGaussian.h>
#include <mrpt/math/CQuaternion.h>
#include <geometry_msgs/PoseWithCovariance.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/Quaternion.h>
#include <tf/tf.h>
#include <mrpt_bridge/pose.h>
#include <gtest/gtest.h>
Go to the source code of this file.
Functions | |
void | check_CPose3D_tofrom_ROS (double x, double y, double z, double yaw, double pitch, double roll) |
void | checkPoseMatrixFromRotationParameters (const double roll, const double pitch, const double yaw) |
TEST (PoseConversions, copyMatrix3x3ToCMatrixDouble33) | |
TEST (PoseConversions, copyCMatrixDouble33ToMatrix3x3) | |
TEST (PoseConversions, checkPoseMatrixFromRotationParameters) | |
TEST (PoseConversions, reference_frame_change_with_rotations) | |
TEST (PoseConversions, check_CPose3D_tofrom_ROS) | |
TEST (PoseConversions, check_CPose2D_to_ROS) |
void check_CPose3D_tofrom_ROS | ( | double | x, |
double | y, | ||
double | z, | ||
double | yaw, | ||
double | pitch, | ||
double | roll | ||
) |
Definition at line 117 of file test_pose.cpp.
void checkPoseMatrixFromRotationParameters | ( | const double | roll, |
const double | pitch, | ||
const double | yaw | ||
) |
Definition at line 21 of file test_pose.cpp.
TEST | ( | PoseConversions | , |
copyMatrix3x3ToCMatrixDouble33 | |||
) |
Definition at line 42 of file test_pose.cpp.
TEST | ( | PoseConversions | , |
copyCMatrixDouble33ToMatrix3x3 | |||
) |
Definition at line 50 of file test_pose.cpp.
TEST | ( | PoseConversions | , |
checkPoseMatrixFromRotationParameters | |||
) |
Definition at line 60 of file test_pose.cpp.
TEST | ( | PoseConversions | , |
reference_frame_change_with_rotations | |||
) |
Definition at line 71 of file test_pose.cpp.
TEST | ( | PoseConversions | , |
check_CPose3D_tofrom_ROS | |||
) |
Definition at line 155 of file test_pose.cpp.
TEST | ( | PoseConversions | , |
check_CPose2D_to_ROS | |||
) |
Definition at line 168 of file test_pose.cpp.