|
moveit2
The MoveIt Motion Planning Framework for ROS 2.
|
#include <string>#include <utility>#include <vector>#include <functional>#include <stdexcept>#include <sensor_msgs/msg/joint_state.hpp>#include <moveit/robot_state/robot_state.hpp>#include <moveit/robot_state/conversions.hpp>#include "robotconfiguration.hpp"

Go to the source code of this file.
Classes | |
| class | pilz_industrial_motion_planner_testutils::JointConfigurationException |
| class | pilz_industrial_motion_planner_testutils::JointConfiguration |
| Class to define a robot configuration in space with the help of joint values. More... | |
Namespaces | |
| namespace | pilz_industrial_motion_planner_testutils |
Typedefs | |
| using | pilz_industrial_motion_planner_testutils::CreateJointNameFunc = std::function< std::string(const size_t &)> |
Functions | |
| std::ostream & | pilz_industrial_motion_planner_testutils::operator<< (std::ostream &, const JointConfiguration &) |