Only released in EOL distros:
Package Summary
Files relating to running 3D simulations of Svenzva manipulators
- Maintainer status: developed
- Maintainer: Max Svetlik <max AT svenzva DOT com>
- Author: Max Svetlik <max AT svenzva DOT com>
- License: BSD
- Bug / feature tracker: https://github.com/SvenzvaRobotics/svenzva_ros/issues
- Source: git https://github.com/SvenzvaRobotics/svenzva_ros.git (branch: master)
Contents
Introduction
This package contains relevant files for running Svenzva robots in 3D simulations. Currently supported simulations are through Gazebo, MoveIt!, or both Gazebo and Moveit!.
For control of robot arms in simulation we use ros_control plugins for Gazebo. This provides software level controllers for each joint which likely will not translate 1-1 on the real robot.
Tips on tuning PID parameters for ros_control can be found on Gazebo's ros_control plugin page (located here) under the section "Tuning PID Parameters".
Supported Version
Simulations have been run in both ROS Indigo (Gazebo 2) and ROS Kinetic (Gazebo 7).
Tutorials
For software guides and tutorials we use the Wiki on our main Github repository.
The tutorial for 3D simulations using Gazebo and/or MoveIt can be found at https://github.com/SvenzvaRobotics/svenzva_ros/wiki/Simulation-with-Gazebo-and-MoveIt!
Nodes
/revel/revel_trajectory_controller
The ros_control interface for trajectory execution. Run when executing Gazebo and Moveit, as it allows MoveIt trajectories to be played back and realized in the Gazebo environment.Subscribed Topics
/revel/effort_joint_trajectory_controller/follow_joint_trajectory/goal (control_msgs/FollowJointTrajectoryActionGoal)- Trajectory action interface goal subscription.
- Dynamic reconfigure linked topic for configuring controller gains.
- Dynamic reconfigure linked topic for configuring controller gains.
- Dynamic reconfigure linked topic for configuring controller gains.
- Dynamic reconfigure linked topic for configuring controller gains.
- Dynamic reconfigure linked topic for configuring controller gains.
- Dynamic reconfigure linked topic for configuring controller gains.
Published Topics
/revel/effort_joint_trajectory_controller/follow_joint_trajectory/feedback (control_msgs/FollowJointTrajectoryActionFeedback)- Trajectory action interface feedback topic.
- Trajectory action interface result topic.
/revel/controller
Spawns and runs a PID controller for each joint outside of a trajectory controller, making it useful for standalone Gazebo simulations. Each motor has its own command and state expositions.Subscribed Topics
/svenzva_controllers/joint_1/command (std_msgs/Float64)- Position command to set the set-point for this joint controller.
- Dynamic Reconfigure configuration topic for changing controller gains.
- Position command to set the set-point for this joint controller.
- Dynamic Reconfigure configuration topic for changing controller gains.
- Position command to set the set-point for this joint controller.
- Dynamic Reconfigure configuration topic for changing controller gains.
- Position command to set the set-point for this joint controller.
- Dynamic Reconfigure configuration topic for changing controller gains.
- Position command to set the set-point for this joint controller.
- Dynamic Reconfigure configuration topic for changing controller gains.
- Position command to set the set-point for this joint controller.
- Dynamic Reconfigure configuration topic for changing controller gains.
Published Topics
/svenzva_controllers/joint_1/state (control_msgs/JointControllerState)- Controller and joint state information for this joint.
- Controller and joint state information for this joint.
- Controller and joint state information for this joint.
- Controller and joint state information for this joint.
- Controller and joint state information for this joint.
- Controller and joint state information for this joint.