#include <string>#include <vector>#include <functional>#include <stdexcept>#include <sensor_msgs/JointState.h>#include <moveit/robot_state/robot_state.h>#include <moveit/robot_state/conversions.h>#include "robotconfiguration.h"

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