39 std::vector<std::string> joint_names;
41 if (!n.
getParam(
"joints", joint_names))
43 joint_names.push_back(
"hiDOF_joint1");
44 joint_names.push_back(
"hiDOF_joint2");
47 for (
const auto& joint_name : joint_names)
55 ROS_INFO(
"Starting JointState Controller");
63 ROS_INFO(
"Stopping JointState Controller");
bool init(hardware_interface::EffortJointInterface *hw, ros::NodeHandle &) override
bool getParam(const std::string &key, std::string &s) const
void update(const ros::Time &, const ros::Duration &) override
JointHandle getHandle(const std::string &name)
std::vector< hardware_interface::JointHandle > joint_effort_commands_
void starting(const ros::Time &) override
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
void stopping(const ros::Time &) override