moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <gtest/gtest.h>
#include <memory>
#include <functional>
#include <pluginlib/class_loader.hpp>
#include <rclcpp/rclcpp.hpp>
#include <tf2_eigen/tf2_eigen.hpp>
#include <moveit/kinematics_base/kinematics_base.h>
#include <moveit/rdf_loader/rdf_loader.h>
#include <moveit/robot_model/robot_model.h>
#include <moveit/robot_state/robot_state.h>
#include <moveit/kdl_kinematics_plugin/kdl_kinematics_plugin.h>
#include <moveit/robot_state/conversions.h>
#include <moveit_msgs/msg/display_trajectory.hpp>
#include <moveit/robot_trajectory/robot_trajectory.h>
#include <moveit/utils/robot_model_test_utils.h>
#include <moveit/utils/logger.hpp>
Go to the source code of this file.
Classes | |
class | SharedData |
class | KinematicsTest |
Macros | |
#define | EXPECT_NEAR_POSES(lhs, rhs, near) |
Functions | |
rclcpp::Logger | getLogger () |
TEST_F (KinematicsTest, getFK) | |
TEST_F (KinematicsTest, randomWalkIK) | |
TEST_F (KinematicsTest, unitIK) | |
TEST_F (KinematicsTest, searchIK) | |
TEST_F (KinematicsTest, searchIKWithCallback) | |
TEST_F (KinematicsTest, getIK) | |
TEST_F (KinematicsTest, getIKMultipleSolutions) | |
TEST_F (KinematicsTest, getNearestIKSolution) | |
int | main (int argc, char **argv) |
Variables | |
const std::string | ROBOT_DESCRIPTION_PARAM = "robot_description" |
const double | DEFAULT_SEARCH_DISCRETIZATION = 0.01f |
const double | EXPECTED_SUCCESS_RATE = 0.8 |
#define EXPECT_NEAR_POSES | ( | lhs, | |
rhs, | |||
near | |||
) |
Definition at line 314 of file test_kinematics_plugin.cpp.
rclcpp::Logger getLogger | ( | ) |
Definition at line 59 of file test_kinematics_plugin.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 766 of file test_kinematics_plugin.cpp.
TEST_F | ( | KinematicsTest | , |
getFK | |||
) |
Definition at line 318 of file test_kinematics_plugin.cpp.
TEST_F | ( | KinematicsTest | , |
getIK | |||
) |
Definition at line 634 of file test_kinematics_plugin.cpp.
TEST_F | ( | KinematicsTest | , |
getIKMultipleSolutions | |||
) |
Definition at line 661 of file test_kinematics_plugin.cpp.
TEST_F | ( | KinematicsTest | , |
getNearestIKSolution | |||
) |
Definition at line 710 of file test_kinematics_plugin.cpp.
TEST_F | ( | KinematicsTest | , |
randomWalkIK | |||
) |
Definition at line 342 of file test_kinematics_plugin.cpp.
TEST_F | ( | KinematicsTest | , |
searchIK | |||
) |
Definition at line 543 of file test_kinematics_plugin.cpp.
TEST_F | ( | KinematicsTest | , |
searchIKWithCallback | |||
) |
Definition at line 584 of file test_kinematics_plugin.cpp.
TEST_F | ( | KinematicsTest | , |
unitIK | |||
) |
Definition at line 435 of file test_kinematics_plugin.cpp.
const double DEFAULT_SEARCH_DISCRETIZATION = 0.01f |
Definition at line 64 of file test_kinematics_plugin.cpp.
const double EXPECTED_SUCCESS_RATE = 0.8 |
Definition at line 65 of file test_kinematics_plugin.cpp.
const std::string ROBOT_DESCRIPTION_PARAM = "robot_description" |
Definition at line 63 of file test_kinematics_plugin.cpp.