Public Member Functions | Public Attributes | Protected Member Functions | List of all members
KinematicsTest Class Reference
Inheritance diagram for KinematicsTest:
Inheritance graph
[legend]

Public Member Functions

testing::AssertionResult expectNearHelper (const char *expr1, const char *expr2, const char *abs_error_expr, const std::vector< geometry_msgs::Pose > &val1, const std::vector< geometry_msgs::Pose > &val2, double abs_error)
 
bool getPositionFK (const std::vector< std::string > &link_names, const std::vector< double > &joint_state, std::vector< geometry_msgs::Pose > &poses, moveit::core::RobotState &robot_state)
 
testing::AssertionResult isNear (const char *expr1, const char *expr2, const char *, const geometry_msgs::Point &val1, const geometry_msgs::Point &val2, double abs_error)
 
testing::AssertionResult isNear (const char *expr1, const char *expr2, const char *, const geometry_msgs::Quaternion &val1, const geometry_msgs::Quaternion &val2, double abs_error)
 
void searchIKCallback (const std::vector< double > &joint_state, moveit_msgs::MoveItErrorCodes &error_code, moveit::core::RobotState &robot_state)
 

Public Attributes

std::vector< double > consistency_limits_
 
std::string group_name_
 
moveit::core::JointModelGroupjmg_
 
std::vector< std::string > joints_
 
kinematics::KinematicsBasePtr kinematics_solver_
 
unsigned int num_fk_tests_
 
unsigned int num_ik_cb_tests_
 
unsigned int num_ik_multiple_tests_
 
unsigned int num_ik_tests_
 
unsigned int num_nearest_ik_tests_
 
bool plugin_fk_support_
 
bool position_only_check_
 
random_numbers::RandomNumberGenerator rng_ { 42 }
 
moveit::core::RobotModelPtr robot_model_
 
std::string root_link_
 
std::vector< double > seed_
 
double timeout_
 
std::string tip_link_
 
double tolerance_
 

Protected Member Functions

void operator= (const SharedData &data)
 
void SetUp () override
 

Detailed Description

Definition at line 164 of file test_kinematics_plugin.cpp.

Member Function Documentation

◆ expectNearHelper()

testing::AssertionResult KinematicsTest::expectNearHelper ( const char *  expr1,
const char *  expr2,
const char *  abs_error_expr,
const std::vector< geometry_msgs::Pose > &  val1,
const std::vector< geometry_msgs::Pose > &  val2,
double  abs_error 
)
inline

Definition at line 248 of file test_kinematics_plugin.cpp.

◆ getPositionFK()

bool KinematicsTest::getPositionFK ( const std::vector< std::string > &  link_names,
const std::vector< double > &  joint_state,
std::vector< geometry_msgs::Pose > &  poses,
moveit::core::RobotState robot_state 
)
inline

Definition at line 295 of file test_kinematics_plugin.cpp.

◆ isNear() [1/2]

testing::AssertionResult KinematicsTest::isNear ( const char *  expr1,
const char *  expr2,
const char *  ,
const geometry_msgs::Point &  val1,
const geometry_msgs::Point &  val2,
double  abs_error 
)
inline

Definition at line 216 of file test_kinematics_plugin.cpp.

◆ isNear() [2/2]

testing::AssertionResult KinematicsTest::isNear ( const char *  expr1,
const char *  expr2,
const char *  ,
const geometry_msgs::Quaternion val1,
const geometry_msgs::Quaternion val2,
double  abs_error 
)
inline

Definition at line 231 of file test_kinematics_plugin.cpp.

◆ operator=()

void KinematicsTest::operator= ( const SharedData data)
inlineprotected

Definition at line 167 of file test_kinematics_plugin.cpp.

◆ searchIKCallback()

void KinematicsTest::searchIKCallback ( const std::vector< double > &  joint_state,
moveit_msgs::MoveItErrorCodes &  error_code,
moveit::core::RobotState robot_state 
)
inline

Definition at line 277 of file test_kinematics_plugin.cpp.

◆ SetUp()

void KinematicsTest::SetUp ( )
inlineoverrideprotected

Definition at line 188 of file test_kinematics_plugin.cpp.

Member Data Documentation

◆ consistency_limits_

std::vector<double> KinematicsTest::consistency_limits_

Definition at line 337 of file test_kinematics_plugin.cpp.

◆ group_name_

std::string KinematicsTest::group_name_

Definition at line 334 of file test_kinematics_plugin.cpp.

◆ jmg_

moveit::core::JointModelGroup* KinematicsTest::jmg_

Definition at line 329 of file test_kinematics_plugin.cpp.

◆ joints_

std::vector<std::string> KinematicsTest::joints_

Definition at line 335 of file test_kinematics_plugin.cpp.

◆ kinematics_solver_

kinematics::KinematicsBasePtr KinematicsTest::kinematics_solver_

Definition at line 330 of file test_kinematics_plugin.cpp.

◆ num_fk_tests_

unsigned int KinematicsTest::num_fk_tests_

Definition at line 340 of file test_kinematics_plugin.cpp.

◆ num_ik_cb_tests_

unsigned int KinematicsTest::num_ik_cb_tests_

Definition at line 341 of file test_kinematics_plugin.cpp.

◆ num_ik_multiple_tests_

unsigned int KinematicsTest::num_ik_multiple_tests_

Definition at line 343 of file test_kinematics_plugin.cpp.

◆ num_ik_tests_

unsigned int KinematicsTest::num_ik_tests_

Definition at line 342 of file test_kinematics_plugin.cpp.

◆ num_nearest_ik_tests_

unsigned int KinematicsTest::num_nearest_ik_tests_

Definition at line 344 of file test_kinematics_plugin.cpp.

◆ plugin_fk_support_

bool KinematicsTest::plugin_fk_support_

Definition at line 345 of file test_kinematics_plugin.cpp.

◆ position_only_check_

bool KinematicsTest::position_only_check_

Definition at line 346 of file test_kinematics_plugin.cpp.

◆ rng_

random_numbers::RandomNumberGenerator KinematicsTest::rng_ { 42 }

Definition at line 331 of file test_kinematics_plugin.cpp.

◆ robot_model_

moveit::core::RobotModelPtr KinematicsTest::robot_model_

Definition at line 328 of file test_kinematics_plugin.cpp.

◆ root_link_

std::string KinematicsTest::root_link_

Definition at line 332 of file test_kinematics_plugin.cpp.

◆ seed_

std::vector<double> KinematicsTest::seed_

Definition at line 336 of file test_kinematics_plugin.cpp.

◆ timeout_

double KinematicsTest::timeout_

Definition at line 338 of file test_kinematics_plugin.cpp.

◆ tip_link_

std::string KinematicsTest::tip_link_

Definition at line 333 of file test_kinematics_plugin.cpp.

◆ tolerance_

double KinematicsTest::tolerance_

Definition at line 339 of file test_kinematics_plugin.cpp.


The documentation for this class was generated from the following file:


moveit_kinematics
Author(s): Dave Coleman , Ioan Sucan , Sachin Chitta
autogenerated on Sat Apr 27 2024 02:26:15