30 #ifndef CONTROLLER_MANAGER_TESTS_MY_ROBOT_HW_1_H 31 #define CONTROLLER_MANAGER_TESTS_MY_ROBOT_HW_1_H 48 virtual bool prepareSwitch(
const std::list<hardware_interface::ControllerInfo>& start_list,
49 const std::list<hardware_interface::ControllerInfo>& stop_list);
50 virtual void doSwitch(
const std::list<hardware_interface::ControllerInfo>& start_list,
51 const std::list<hardware_interface::ControllerInfo>& stop_list);
hardware_interface::VelocityJointInterface vj_interface_
virtual void write(const ros::Time &time, const ros::Duration &period)
hardware_interface::JointStateInterface js_interface_
std::vector< double > joint_velocity_
virtual bool prepareSwitch(const std::list< hardware_interface::ControllerInfo > &start_list, const std::list< hardware_interface::ControllerInfo > &stop_list)
std::vector< double > joint_velocity_command_
virtual bool init(ros::NodeHandle &root_nh, ros::NodeHandle &robot_hw_nh)
std::vector< std::string > joint_name_
std::vector< double > joint_effort_command_
virtual void read(const ros::Time &time, const ros::Duration &period)
std::vector< double > joint_effort_
std::vector< double > joint_position_
virtual void doSwitch(const std::list< hardware_interface::ControllerInfo > &start_list, const std::list< hardware_interface::ControllerInfo > &stop_list)
hardware_interface::EffortJointInterface ej_interface_