Go to the documentation of this file.
23 "JointPositionController: Error getting position joint interface from hardware!");
28 ROS_ERROR(
"JointPositionController: Could not parse joint names");
31 ROS_ERROR_STREAM(
"JointPositionController: Wrong number of joint names, got "
36 for (
size_t i = 0; i < 7; ++i) {
41 "JointPositionController: Exception getting joint handles: " << e.
what());
46 std::vector<double> target_positions;
47 if (!node_handle.
getParam(
"/target_joint_positions", target_positions) || target_positions.size() != 7) {
48 ROS_ERROR(
"JointPositionController: Could not read target joint positions from parameter server or incorrect size");
51 for (
size_t i = 0; i < 7; ++i) {
59 for (
size_t i = 0; i < 7; ++i) {
69 for (
size_t i = 0; i < 7; ++i) {
PLUGINLIB_EXPORT_CLASS(moveit_fake_controller_manager::MoveItFakeControllerManager, moveit_controller_manager::MoveItControllerManager)
std::array< double, 7 > reset_pose_
#define ROS_ERROR_STREAM(args)
JointHandle getHandle(const std::string &name)
const char * what() const noexcept override
bool getParam(const std::string &key, bool &b) const
ros::Duration elapsed_time_
bool init(hardware_interface::RobotHW *robot_hardware, ros::NodeHandle &node_handle) override
std::vector< hardware_interface::JointHandle > position_joint_handles_
std::array< std::string, 7 > joint_names
void starting(const ros::Time &) override
void update(const ros::Time &, const ros::Duration &period) override
std::array< double, 7 > initial_pose_
hardware_interface::PositionJointInterface * position_joint_interface_