|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/Kinovarobotics/jaco-ros.git |
VCS Type | git |
VCS Version | noetic-devel |
Last Updated | 2021-12-20 |
Dev Status | MAINTAINED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Siddharth Oli
Authors
- Dave Coleman
Gazebo for Kinova robots
Supported versions
The recommended configuration is ROS Noetic with 64 bit Ubuntu 20.04.
For older configurations, see the other branches melodic-devel, kinetic-devel and indigo-devel.
New in this release
- Gazebo support for Jaco, Mico, 7-dof robot
- Gazebo/ros_control parameters added to URDF
- ros_control config files added
- launch files to launch gazebo with ros_control
- script to send trajectory command to robot
- Interface with MoveIt!
Installation
- Install Gazebo. For detailed instructions see install page.
sudo apt-get install ros-<distro>-gazebo-ros*
- Install ros_control ros_controllers repository.
sudo apt-get install ros-<distro>-gazebo-ros-control
sudo apt-get install ros-<distro>-ros-controllers
sudo apt-get install ros-<distro>-trac-ik-kinematics-plugin
Gazebo/ros_control parameters added to Gazebo
Inertial parameters have been added to all mesh models to support gazebo. Each link has the inertial model for the link and half of the actuator on one side and half on the other side. COM position and mass of the links are accurate to result in correct torque readings.
The inertia matrix however is a approximation, assuming uniform cylinders for links. More accurate values will be added later.
The joint dynamics parameters, like damping, friction, stiffness, do not accurately represent the hardware.
The joints are configured to have a effortJointInterface.
ros_control
We use ros_control to control the robot model in Gazebo. See tutorial here - ros_control tutorial.
The config files for controlling the joints using ros-control have been added for the three robot types. Three different types of controllers are available - effort, position, velocity.
Trajectory controller has also been added to provide interface for MoveIt!.
Recommended way to control the robot is to use trajectory controller.
Launching Gazebo with ros_control
You can launch Gazebo using the launch file -
roslaunch kinova_gazebo robot_launch.launch kinova_robotType:=j2n6s300
The launch file - 1) Launches Gazebo 2) Loads the robot model in Gazebo 3) Launches ros_control controller for the robot 4) Loads RViz with an empty default view
To show the robot's state in RViz -
1) in RViz (in the display section) change Global Options -> Fixed Frame to world
2) add robot's model with Add -> RobotModel (in rviz folder)
By default the controller is set to launch a trajectory position controller, this is how moveIt! commands the robot. If you would like to control the joint by joint, set use_trajectory_controller = false
roslaunch kinova_gazebo robot_launch.launch kinova_robotType:=j2n6s300 use_trajectory_controller:=false
Moving the robot
To move the robot in Gazebo using the trajectory controller user can publish jointTrajectory commands to the topic - /robot_name/effort_joint_trajectory_controller/command. An example script is available to move the robot to home position.
rosrun kinova_control move_robot.py j2n6s300
The robot can also be commanded joint by joint through rqt (you can also add the argument rqt:=true
when initialy launching Gazebo to launch rqt automatically) -
roslaunch kinova_control kinova_rqt.launch kinova_robotType:=j2n6s300
For this however, set use_trajectory_controller = false as explained above.
Interface with MoveIt!
First launch Gazebo -
roslaunch kinova_gazebo robot_launch.launch kinova_robotType:=j2n6s300
Next launch moveIt and RViz -
roslaunch j2n6s300_moveit_config j2n6s300_gazebo_demo.launch
You can use the interactive markers in rviz to plan trajectories and when you click execute trajectories are executed in Gazebo.
You can also run the pick and place demo, more info about it in the MoveIt wiki here
rosrun kinova_arm_moveit_demo pick_place
Report a Bug
Any bugs, issues or suggestions may be sent to ros@kinovarobotics.com.
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | catkin | |
1 | gazebo_plugins | |
1 | gazebo_ros | |
1 | gazebo_ros_control | |
1 | kinova_control | |
1 | kinova_description | |
1 | xacro |
System Dependencies
Dependant Packages
Launch files
- launch/robot_launch.launch
-
- kinova_robotType [default: j2n6s300]
- kinova_robotName [default: $(arg kinova_robotType)]
- paused [default: true]
- use_sim_time [default: true]
- gui [default: true]
- headless [default: false]
- debug [default: false]
- use_trajectory_controller [default: true]
- is7dof [default: false]
- rqt [default: false]
- has2finger [default: false]
- description_name [default: robot_description]
Messages
Services
Plugins
Recent questions tagged kinova_gazebo at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/Kinovarobotics/jaco-ros.git |
VCS Type | git |
VCS Version | melodic-devel |
Last Updated | 2021-12-20 |
Dev Status | MAINTAINED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Siddharth Oli
Authors
- Dave Coleman
Gazebo for Kinova robots
Supported versions
The recommended configuration for this branch is ROS Melodic with 64 bit Ubuntu 18.04.
For other configurations, see the other branches noetic-devel, kinetic-devel and indigo-devel.
New in this release
- Gazebo support for Jaco, Mico, 7-dof robot
- Gazebo/ros_control parameters added to URDF
- ros_control config files added
- launch files to launch gazebo with ros_control
- script to send trajectory command to robot
- Interface with MoveIt!
Installation
- Install Gazebo. For detailed instructions see install page.
sudo apt-get install ros-<distro>-gazebo-ros*
- Install ros_control ros_controllers repository.
sudo apt-get install ros-<distro>-gazebo-ros-control
sudo apt-get install ros-<distro>-ros-controllers
sudo apt-get install ros-<distro>-trac-ik-kinematics-plugin
Gazebo/ros_control parameters added to Gazebo
Inertial parameters have been added to all mesh models to support gazebo. Each link has the inertial model for the link and half of the actuator on one side and half on the other side. COM position and mass of the links are accurate to result in correct torque readings.
The inertia matrix however is a approximation, assuming uniform cylinders for links. More accurate values will be added later.
The joint dynamics parameters, like damping, friction, stiffness, do not accurately represent the hardware.
The joints are configured to have a effortJointInterface.
ros_control
We use ros_control to control the robot model in Gazebo. See tutorial here - ros_control tutorial.
The config files for controlling the joints using ros-control have been added for the three robot types. Three different types of controllers are available - effort, position, velocity.
Trajectory controller has also been added to provide interface for MoveIt!.
Recommended way to control the robot is to use trajectory controller.
Launching Gazebo with ros_control
You can launch Gazebo using the launch file -
roslaunch kinova_gazebo robot_launch.launch kinova_robotType:=j2n6s300
The launch file - 1) Launches Gazebo 2) Loads the robot model in Gazebo 3) Launches ros_control controller for the robot 4) Loads RViz with an empty default view
To show the robot's state in RViz -
1) in RViz (in the display section) change Global Options -> Fixed Frame to world
2) add robot's model with Add -> RobotModel (in rviz folder)
By default the controller is set to launch a trajectory position controller, this is how moveIt! commands the robot. If you would like to control the joint by joint, set use_trajectory_controller = false
roslaunch kinova_gazebo robot_launch.launch kinova_robotType:=j2n6s300 use_trajectory_controller:=false
Moving the robot
To move the robot in Gazebo using the trajectory controller user can publish jointTrajectory commands to the topic - /robot_name/effort_joint_trajectory_controller/command. An example script is available to move the robot to home position.
rosrun kinova_control move_robot.py j2n6s300
The robot can also be commanded joint by joint through rqt (you can also add the argument rqt:=true
when initialy launching Gazebo to launch rqt automatically) -
roslaunch kinova_control kinova_rqt.launch kinova_robotType:=j2n6s300
For this however, set use_trajectory_controller = false as explained above.
Interface with MoveIt!
First launch Gazebo -
roslaunch kinova_gazebo robot_launch.launch kinova_robotType:=j2n6s300
Next launch moveIt and RViz -
roslaunch j2n6s300_moveit_config j2n6s300_gazebo_demo.launch
You can use the interactive markers in rviz to plan trajectories and when you click execute trajectories are executed in Gazebo.
You can also run the pick and place demo, more info about it in the MoveIt readme here
rosrun kinova_arm_moveit_demo pick_place
Report a Bug
Any bugs, issues or suggestions may be sent to ros@kinovarobotics.com.
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | catkin | |
1 | gazebo_plugins | |
1 | gazebo_ros | |
1 | gazebo_ros_control | |
1 | kinova_control | |
1 | kinova_description | |
1 | xacro |
System Dependencies
Dependant Packages
Launch files
- launch/robot_launch.launch
-
- kinova_robotType [default: j2n6s300]
- kinova_robotName [default: $(arg kinova_robotType)]
- paused [default: true]
- use_sim_time [default: true]
- gui [default: true]
- headless [default: false]
- debug [default: false]
- use_trajectory_controller [default: true]
- is7dof [default: false]
- rqt [default: false]
- has2finger [default: false]
- description_name [default: robot_description]
Messages
Services
Plugins
Recent questions tagged kinova_gazebo at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/Kinovarobotics/jaco-ros.git |
VCS Type | git |
VCS Version | indigo-devel |
Last Updated | 2019-07-17 |
Dev Status | MAINTAINED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Siddharth Oli
Authors
- Dave Coleman
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | catkin | |
1 | gazebo_plugins | |
1 | gazebo_ros | |
1 | gazebo_ros_control | |
1 | kinova_control | |
1 | kinova_description | |
1 | xacro |
System Dependencies
Dependant Packages
Launch files
- launch/robot_launch.launch
-
- kinova_robotType [default: j2n6s300]
- kinova_robotName [default: $(arg kinova_robotType)]
- paused [default: true]
- use_sim_time [default: true]
- gui [default: true]
- headless [default: false]
- debug [default: false]
- use_trajectory_controller [default: true]
- is7dof [default: false]
Messages
Services
Plugins
Recent questions tagged kinova_gazebo at answers.ros.org
|
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/Kinovarobotics/jaco-ros.git |
VCS Type | git |
VCS Version | kinetic-devel |
Last Updated | 2021-06-08 |
Dev Status | MAINTAINED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Siddharth Oli
Authors
- Dave Coleman
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | catkin | |
1 | gazebo_plugins | |
1 | gazebo_ros | |
1 | gazebo_ros_control | |
1 | kinova_control | |
1 | kinova_description | |
1 | xacro |
System Dependencies
Dependant Packages
Launch files
- launch/robot_launch.launch
-
- kinova_robotType [default: j2n6s300]
- kinova_robotName [default: $(arg kinova_robotType)]
- paused [default: true]
- use_sim_time [default: true]
- gui [default: true]
- headless [default: false]
- debug [default: false]
- use_trajectory_controller [default: true]
- is7dof [default: false]