ros-controls / ros_control

Generic and simple controls framework for ROS
http://wiki.ros.org/ros_control
BSD 3-Clause "New" or "Revised" License
470 stars 307 forks source link

Why car model continuing jump After load controller_manage? #466

Closed Joeylllshen closed 4 years ago

Joeylllshen commented 4 years ago

Hello,

Recently , I was working on smart car project . Use gazebo simulate smart car .

where I just load one joint controller " right_back_wheel_velocity_controller". ( If I load all controller , model parts rapid and no rules move, then the car will split into parts , stop at zeros.)

when I start ROS launch (see roslaunch mycar.launch), and pressed down start in gazebo. my car fall down , then car continual jump? The rqt_graph figure see figure.1 .

Then check topic /mycar/joint_states , find that acting a effort on joint, this is limit value in xacro. See figure.2.

After that, I use rqt_controller_mananger manual load "right_back_wheel_velocity_controller" or other controller , the problem also like above . Stop controller, car stop.

I think the problem is with the controller, or my parameters? Or something?

But Why would my car continuing jump after I load controller_manage ? and Why does load controller then would have a effort acting on joint ?

* mycar.xacro part
```xml 
  <joint
    name="right_back_wheel_joint"
    type="continuous">
    <origin
      xyz="-0.013597 0.034853 0.060173"
      rpy="-3.1416 0.40836 -1.5746" />
    <parent
      link="base_link" />
    <child
      link="right_back_wheel" />
    <axis
      xyz="0 1 0" />
    <limit
      effort="10"
      velocity="1000" /> 
  </joint>

  <transmission name="right_back_wheel_transmission">
      <type>transmission_interface/SimpleTransmission</type>
      <joint name="right_back_wheel_joint">
          <hardwareInterface>hardware_interface/EffortJointInterface</hardwareInterface>
      </joint>
      <actuator name ="right_back_wheel_motor">
          <hardwareInterface>hardware_interface/EffortJointInterface</hardwareInterface>
          <mechanicalReduction>1</mechanicalReduction>
      </actuator>
  </transmission>

  <link
    name="left_back_wheel">

1184479047

2051282145

Joeylllshen commented 4 years ago

I may find a problem. It seems that the quality of the parts is too light. The mass is too light after I export it with SOLIDWORK tool?