#include <moveit_resources/config.h>
#include <moveit/robot_model/robot_model.h>
#include <moveit/robot_state/robot_state.h>
#include <urdf_parser/urdf_parser.h>
#include <gtest/gtest.h>
#include <sstream>
#include <algorithm>
#include <ctype.h>
Go to the source code of this file.
|
static void | expect_near (const Eigen::MatrixXd &x, const Eigen::MatrixXd &y, double eps=std::numeric_limits< double >::epsilon()) |
|
std::size_t | generateTestTraj (std::vector< std::shared_ptr< robot_state::RobotState >> &traj, const moveit::core::RobotModelConstPtr &robot_model, const robot_model::JointModelGroup *joint_model_group) |
|
int | main (int argc, char **argv) |
|
static bool | sameStringIgnoringWS (const std::string &s1, const std::string &s2) |
|
| TEST (Loading, SimpleRobot) |
|
| TEST (LoadingAndFK, SimpleRobot) |
|
| TEST_F (OneRobot, FK) |
|
| TEST_F (OneRobot, testGenerateTrajectory) |
|
| TEST_F (OneRobot, testAbsoluteJointSpaceJump) |
|
| TEST_F (OneRobot, testRelativeJointSpaceJump) |
|
#define EXPECT_NEAR_TRACED |
( |
|
... | ) |
|
Value:{ \
SCOPED_TRACE(
"expect_near(" #__VA_ARGS__
")");
\}
static void expect_near(const Eigen::MatrixXd &x, const Eigen::MatrixXd &y, double eps=std::numeric_limits< double >::epsilon())
Definition at line 80 of file robot_state_test.cpp.
static void expect_near |
( |
const Eigen::MatrixXd & |
x, |
|
|
const Eigen::MatrixXd & |
y, |
|
|
double |
eps = std::numeric_limits<double>::epsilon() |
|
) |
| |
|
static |
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
static bool sameStringIgnoringWS |
( |
const std::string & |
s1, |
|
|
const std::string & |
s2 |
|
) |
| |
|
static |
TEST |
( |
Loading |
, |
|
|
SimpleRobot |
|
|
) |
| |
TEST |
( |
LoadingAndFK |
, |
|
|
SimpleRobot |
|
|
) |
| |
TEST_F |
( |
OneRobot |
, |
|
|
testGenerateTrajectory |
|
|
) |
| |
TEST_F |
( |
OneRobot |
, |
|
|
testAbsoluteJointSpaceJump |
|
|
) |
| |
TEST_F |
( |
OneRobot |
, |
|
|
testRelativeJointSpaceJump |
|
|
) |
| |