Go to the documentation of this file.
17 std::vector<UndercarriageDirectCtrl::WheelParams> wheel_params;
25 for (
unsigned i=0; i<wheel_params.size(); i++){
26 this->
steer_joints_.push_back(p->getHandle(wheel_params[i].geom.steer_name));
30 catch(
const std::exception &e){
34 return this->
setup(root_nh,controller_nh);
#define ROS_ERROR_STREAM(args)
bool parseWheelParams(std::vector< UndercarriageGeom::WheelParams > ¶ms, const ros::NodeHandle &nh, bool read_urdf=true)
std::vector< hardware_interface::JointHandle > drive_joints_
JointHandle getHandle(const std::string &name)
bool setup(const std::vector< typename Controller::WheelParams > &wheel_params)
bool setup(ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh)
#define PLUGINLIB_EXPORT_CLASS(class_type, base_class_type)
virtual void update(const ros::Time &time, const ros::Duration &period)
void updateCtrl(const ros::Time &time, const ros::Duration &period)
virtual bool init(hardware_interface::RobotHW *robot_hw, ros::NodeHandle &root_nh, ros::NodeHandle &controller_nh)
std::vector< WheelCommand > wheel_commands_
std::vector< hardware_interface::JointHandle > steer_joints_