Class to define a robot configuration in space with the help of joint values.
More...
#include <jointconfiguration.h>
Class to define a robot configuration in space with the help of joint values.
Definition at line 47 of file jointconfiguration.h.
◆ JointConfiguration() [1/3]
| pilz_industrial_motion_testutils::JointConfiguration::JointConfiguration |
( |
| ) |
|
◆ JointConfiguration() [2/3]
| pilz_industrial_motion_testutils::JointConfiguration::JointConfiguration |
( |
const std::string & |
group_name, |
|
|
const std::vector< double > & |
config, |
|
|
CreateJointNameFunc && |
create_joint_name_func |
|
) |
| |
◆ JointConfiguration() [3/3]
| pilz_industrial_motion_testutils::JointConfiguration::JointConfiguration |
( |
const std::string & |
group_name, |
|
|
const std::vector< double > & |
config, |
|
|
const moveit::core::RobotModelConstPtr & |
robot_model |
|
) |
| |
◆ getJoint()
| double pilz_industrial_motion_testutils::JointConfiguration::getJoint |
( |
const size_t |
index | ) |
const |
|
inline |
◆ getJoints()
| const std::vector< double > pilz_industrial_motion_testutils::JointConfiguration::getJoints |
( |
| ) |
const |
|
inline |
◆ setCreateJointNameFunc()
| void pilz_industrial_motion_testutils::JointConfiguration::setCreateJointNameFunc |
( |
CreateJointNameFunc |
create_joint_name_func | ) |
|
|
inline |
◆ setJoint()
| void pilz_industrial_motion_testutils::JointConfiguration::setJoint |
( |
const size_t |
index, |
|
|
const double |
value |
|
) |
| |
|
inline |
◆ size()
| size_t pilz_industrial_motion_testutils::JointConfiguration::size |
( |
| ) |
const |
|
inline |
◆ toGoalConstraints()
| moveit_msgs::Constraints pilz_industrial_motion_testutils::JointConfiguration::toGoalConstraints |
( |
| ) |
const |
|
inlineoverridevirtual |
◆ toGoalConstraintsWithModel()
| moveit_msgs::Constraints pilz_industrial_motion_testutils::JointConfiguration::toGoalConstraintsWithModel |
( |
| ) |
const |
|
private |
◆ toGoalConstraintsWithoutModel()
| moveit_msgs::Constraints pilz_industrial_motion_testutils::JointConfiguration::toGoalConstraintsWithoutModel |
( |
| ) |
const |
|
private |
◆ toMoveitMsgsRobotState()
| moveit_msgs::RobotState pilz_industrial_motion_testutils::JointConfiguration::toMoveitMsgsRobotState |
( |
| ) |
const |
|
inlineoverridevirtual |
◆ toMoveitMsgsRobotStateWithModel()
| moveit_msgs::RobotState pilz_industrial_motion_testutils::JointConfiguration::toMoveitMsgsRobotStateWithModel |
( |
| ) |
const |
|
private |
◆ toMoveitMsgsRobotStateWithoutModel()
| moveit_msgs::RobotState pilz_industrial_motion_testutils::JointConfiguration::toMoveitMsgsRobotStateWithoutModel |
( |
| ) |
const |
|
private |
◆ toRobotState()
| robot_state::RobotState pilz_industrial_motion_testutils::JointConfiguration::toRobotState |
( |
| ) |
const |
◆ toSensorMsg()
| sensor_msgs::JointState pilz_industrial_motion_testutils::JointConfiguration::toSensorMsg |
( |
| ) |
const |
◆ create_joint_name_func_
| CreateJointNameFunc pilz_industrial_motion_testutils::JointConfiguration::create_joint_name_func_ |
|
private |
◆ joints_
| std::vector<double> pilz_industrial_motion_testutils::JointConfiguration::joints_ |
|
private |
The documentation for this class was generated from the following files: