No version for distro humble. Known supported distros are highlighted in the buttons above.
No version for distro iron. Known supported distros are highlighted in the buttons above.
No version for distro rolling. Known supported distros are highlighted in the buttons above.

Package Summary

Tags No category tags.
Version 1.0.2
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://bitbucket.org/prensiliasrl/mia_hand_ros_pkgs.git
VCS Type git
VCS Version master
Last Updated 2024-01-15
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Package for simulating Mia Hand in Gazebo, interfacing simulation with ROS Control.

Additional Links

Maintainers

  • Andrea Burani
  • Francesca Cini

Authors

  • Andrea Burani
  • Francesca Cini

mia_hand_gazebo

Package for simulating Mia Hand in Gazebo environment, interfacing the simulated hardware with ROS Control. The cpp class Mia_hw_sim expand the gazebo class gazebo_ros_control/DefaultRobotHWSim and allow to simulate the non linear behaviour of the Mia Hand coupled fingers. To be used add the MiaHWSim plugin lib in the gazebo ros control plugin lines as shown in the following example:

< gazebo >
    <plugin name="gazebo_ros_control" filename="libgazebo_ros_control.so">
        <robotNamespace> $(arg robotNamespace) </robotNamespace>
        <robotSimType> mia/MiaHWSim </robotSimType>
    </plugin>
<gazebo>

In the folder config some simple controllers and trajectories controllers are provided. Please note that these controllers can be used in the robotNamespace "/". If the exploited robotnamespace is different adjust the namespace by declaring the robotNamespace argumentes in the launch file listed below. By default robotNamespace:=mia_hand_sim.

To launch the Mia Hand simulation you can use one of the following commands (please use robotNamespace arg to specify the namespace, by default robotNamespace:=mia_hand_sim):

  • to launch simulation with one controller (velocity controller as default) for each DoF of the Mia Hand:

    roslaunch mia_hand_bringup mia_hand_Sim.launch
    
  • to launch simulation with one controller for each DoF of the Mia Hand specifying its type (in the exaple Position controllers for the thumb, Effort controllers for the index and Velocity controller for the mrl fingers:

    roslaunch mia_hand_bringup mia_hand_Sim.launch hw_interface_thumb_fle:=PositionJointInterface controller_thumb_fle:=position hw_interface_index_fle:=EffortJointInterface controller_index_fle:=eff hw_interface_mrl_fle:=VelocityJointInterface controller_mrl_fle:=velocity
    
  • to launch simulation with trajectory controller (velocity controller as default):

     roslaunch mia_hand_bringup mia_hand_Sim_traj.launch
    
  • to launch simulation with trajectory controller specifying the type

    • (for example velocity):

      roslaunch mia_hand_bringup mia_hand_Sim_traj.launch tc_type:=vel eff_interface:=false

    • (for example position):

      roslaunch mia_hand_bringup mia_hand_Sim_traj.launch tc_type:=pos eff_interface:=false

    • Note that: Effort control is not implemented in the real Mia hand.

Other inputs arguments of the launch file are:

 Rviz_on:                          default="true"                      doc="True to start Rviz and the joint state gui"
 use_joint_gui:                    default="true"                      doc="Enable the joint_state_publisher use a GUI for controlling joint states"
 right_hand:                       default="true"                      doc="True for right hand False otherwise"
 load_default_mia_model:           default="false"                     doc="flag to load URDF with default or calibrated joint parameters eg. joint limits"
 joint_limits_config_filename:     default="joint_limits.yaml"         doc="name of the config yaml file to calibrate joints limit of URDF file"
 transmission_config_filename:     default="transmission_config.yaml"  doc="name of the config yaml file to calibrate transmissions of Mia Hand"
 UR_Flange:                        default = "false"                   doc="True to visualize the UR flange with the Mia Hand"
 robotNamespace:                   default="mia_hand_sim"              doc="Name space of the robot and its releated topics"
 paused:                           default="false"                     doc="Gazebo world settings"
 use_sim_time:                     default="true"                      doc="Gazebo world settings"
 Gazebo_gui:                       default="true"                      doc="Gazebo world settings"
 headless:                         default="false"                     doc="Gazebo world settings"
 debug:                            default="false"                     doc="Gazebo world settings"
 tc_type:                          default="vel"                       doc="type of trajectory controller to launch. Values: vel, pos, eff"

 Arguments automatically set:
 hw_interface_thumb_fle:           default="PositionJointInterface"    doc="Type of hardware intereface to load in the mia_hand_gazebo.urdf.xacro file for the index flexion joint
 hw_interface_index_fle:           default="PositionJointInterface"    doc="Type of hardware intereface to load in the mia_hand_gazebo.urdf.xacro file for the thumb flexion joint
 hw_interface_mrl_fle:             default="PositionJointInterface"    doc="Type of hardware intereface to load in the mia_hand_gazebo.urdf.xacro file for the mrl flexion joint

Please note that to these launch files load the mia joint transmission YAML configuration file (stored in the mia_hand_description/calibration folder) to the parameter server.

CHANGELOG

Changelog for package mia_hand_gazebo

1.0.2 (2022-02-07)

1.0.1 (2022-02-07)

1.0.0 (2022-01-25)

  • 1.0.0
  • Updated CHANGELOG files.
  • Updated CHANGELOG files.
  • Added srv dependency to mia_hand_driver and joint_state_interface to mmia_hand_description. Added wiki url links.
  • Added license file in the repo and license text as header of each file.
  • Added licence file and licence text as header of each file.
  • 1.0.0
  • Merge branch \'master\' of https://bitbucket.org/prensiliasrl/mia_hand_ros_pkgs
  • Added ChangeLog files of each pkg.
  • CMakeLists.txt edited the name of the xml file to install.
  • Initial commit.
  • Fix package xml files.
  • Initial commit.
  • Contributors: Andrea Burani, Francesca Cini, frcini

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Recent questions tagged mia_hand_gazebo at Robotics Stack Exchange

No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.
No version for distro crystal. Known supported distros are highlighted in the buttons above.
No version for distro eloquent. Known supported distros are highlighted in the buttons above.
No version for distro dashing. Known supported distros are highlighted in the buttons above.
No version for distro galactic. Known supported distros are highlighted in the buttons above.
No version for distro foxy. Known supported distros are highlighted in the buttons above.
No version for distro lunar. Known supported distros are highlighted in the buttons above.
No version for distro jade. Known supported distros are highlighted in the buttons above.
No version for distro indigo. Known supported distros are highlighted in the buttons above.
No version for distro hydro. Known supported distros are highlighted in the buttons above.
No version for distro kinetic. Known supported distros are highlighted in the buttons above.
No version for distro melodic. Known supported distros are highlighted in the buttons above.