Go to the documentation of this file.
74 bool prepareSwitch(
const std::list<hardware_interface::ControllerInfo>& start_list,
75 const std::list<hardware_interface::ControllerInfo>& stop_list)
override;
81 void doSwitch(
const std::list<hardware_interface::ControllerInfo>& start_list,
82 const std::list<hardware_interface::ControllerInfo>& stop_list)
override;
112 std::list<hardware_interface::ControllerInfo>& filtered_list,
bool init(ros::NodeHandle &root_nh, ros::NodeHandle &robot_hw_nh) override
The init function is called to initialize the RobotHW from a non-realtime thread.
pluginlib::ClassLoader< hardware_interface::RobotHW > robot_hw_loader_
void doSwitch(const std::list< hardware_interface::ControllerInfo > &start_list, const std::list< hardware_interface::ControllerInfo > &stop_list) override
std::vector< hardware_interface::RobotHWSharedPtr > robot_hw_list_
bool prepareSwitch(const std::list< hardware_interface::ControllerInfo > &start_list, const std::list< hardware_interface::ControllerInfo > &stop_list) override
ros::NodeHandle robot_hw_nh_
void write(const ros::Time &time, const ros::Duration &period) override
void read(const ros::Time &time, const ros::Duration &period) override
void filterControllerList(const std::list< hardware_interface::ControllerInfo > &list, std::list< hardware_interface::ControllerInfo > &filtered_list, hardware_interface::RobotHWSharedPtr robot_hw)
Filters the start and stop lists so that they only contain the controllers and resources that corresp...
std::shared_ptr< RobotHW > RobotHWSharedPtr
virtual bool loadRobotHW(const std::string &name)