Only released in EOL distros:
Package Summary
A package that exchanges kinematic properties such as velocity or position between multiple cyber physical systems (CPSs) in a swarm.
- Maintainer status: developed
- Maintainer: Micha Sende <sende AT lakeside-labs DOT com>
- Author: Micha Sende <sende AT lakeside-labs DOT com>
- License: Apache License 2.0
- Source: git https://github.com/cpswarm/swarm_functions.git (branch: kinetic-devel)
Contents
Dependencies
This package depends on the following message definitions:
The communication between CPSs is based on the CPSwarm Communication Library.
The following packages of the sensing and actuation library are required:
- *_pos_provider
- *_vel_provider
Further required packages are:
Execution
Run the launch file
roslaunch kinematics_exchanger kinematics_exchanger.launch
to launch the kinematics_exchanger node.
The launch file can be configured with following parameters:
id (integer, default: 1)
- The identifier (ID) of the CPS used for name spacing in simulation.
output (string, default: screen)
Whether to show the program output (screen) or to write it to a log file (log).
In the param subdirectory there is the parameter file kinematics_exchanger.yaml that allows to configure the behavior of the kinematics_exchanger node.
Nodes
kinematics_exchanger
The kinematics_exchanger node publishes position and velocity of this CPS to the rest of the swarm and publishes the position and velocity received from the other swarm members locally. It publishes the swarm position both as relative and absolute coordinates. The swarm velocity is published only as relative coordinates.Subscribed Topics
pos_provider/pose (geometry_msgs/PoseStamped)- The current position of this CPS.
- The current velocity of this CPS.
- The current position of another CPS. Messages are exchanged between CPSs using the CPSwarm Communication Library.
- The current velocity of another CPS. Messages are exchanged between CPSs using the CPSwarm Communication Library.
Published Topics
position (cpswarm_msgs/Position)- The current position of this CPS that is forwarded by the CPSwarm Communication Library to the other swarm members.
- The current velocity of this CPS that is forwarded by the CPSwarm Communication Library to the other swarm members.
- The positions of the other swarm members received through the CPSwarm Communication Library.
- The positions of the other swarm members received through the CPSwarm Communication Library relative to the position of this CPS.
- The velocities of the other swarm members received through the CPSwarm Communication Library relative to the velocity of this CPS.
Parameters
~loop_rate (real, default: 1.5)- The frequency in Hz at which to run the control loops.
- The size of the message queue used for publishing and subscribing to topics.
- The time in seconds after which another CPS is considered to have left the swarm.
- The number of data samples to average over for reliable results.
- The number of messages to ignore during initialization. This is because the first messages are inaccurate.
Acknowledgements
This work is supported by the European Commission through the CPSwarm H2020 project under grant no. 731946.