#include "ros/ros.h"
#include <gtest/gtest.h>
#include <Eigen/Core>
#include <Eigen/Dense>
#include <moveit/robot_model_loader/robot_model_loader.h>
#include <moveit/robot_model/robot_model.h>
#include <moveit/robot_state/robot_state.h>
#include <math.h>
Go to the source code of this file.
|
typedef std::tuple< std::string, std::vector< double >, Eigen::Vector3d > | TestDataPoint |
|
|
const std::string | ARM_GROUP_NAME { "arm_group_name" } |
|
const std::string | ARM_GROUP_TIP_LINK_NAME { "arm_tip_link" } |
|
static constexpr double | DELTA { 1.0e-10 } |
|
static constexpr double | L0 { 0.2604 } |
|
static constexpr double | L1 { 0.3500 } |
|
static constexpr double | L2 { 0.3070 } |
|
static constexpr double | L3 { 0.0840 } |
|
const std::string | PARAM_MODEL { "robot_description" } |
|
#define _USE_MATH_DEFINES |
typedef std::tuple<std::string, std::vector<double>, Eigen::Vector3d> TestDataPoint |
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
test the kinematics of urdf model
Assures that the forward kinematics behave as expected. This is done by looping over multiple test data points and checking the tcp position (not the pose!).
Definition at line 117 of file urdf_tests.cpp.
std::string vecToString |
( |
std::vector< double > & |
vec | ) |
|
const std::string ARM_GROUP_NAME { "arm_group_name" } |
const std::string ARM_GROUP_TIP_LINK_NAME { "arm_tip_link" } |
constexpr double DELTA { 1.0e-10 } |
|
static |
constexpr double L0 { 0.2604 } |
|
static |
constexpr double L1 { 0.3500 } |
|
static |
constexpr double L2 { 0.3070 } |
|
static |
constexpr double L3 { 0.0840 } |
|
static |
const std::string PARAM_MODEL { "robot_description" } |