Skip to content

Releases: siemens/ros-sharp

ROS# Version 1.7.0

01 Feb 10:00
Compare
Choose a tag to compare
  • updating to Unity Version 2019.4.18f1
  • multiple minor fixes, see commit history for details

ROS# Version 1.6.0

20 Dec 14:54
Compare
Choose a tag to compare

Automatic Message Generation:

  • With ROS# you can now generate C# classes of any ROS message, service or action type.
  • For example, the auto-generated class of sensor_msgs/JointState.msg is JointState.cs.
  • Please find the new library here and the console tool sources here.
  • Please also note the new Unity Editor menu features.
  • Check out the new Wiki page for further info.

Action Server and Action Client Revision:

  • Check out the new Wiki pages for [Action Server] and [Action Client] for further info.

ROS# Version 1.5.0

28 Jun 13:55
Compare
Choose a tag to compare

The biggest changes in ROS# Version 1.5 are:

  • ROS Action Support:
    Please check out the FibonacciActionServer and FibonacciActionClient example and find the corresponding ROS tutorial here.

  • Message Class Generation via Unity Editor:
    Please check out the new Unity menu item RosBridgeClient > Generate Messages > ...
    This wiki page gives an overview on the different options to generate new message files.

  • BSON (De-)Serialization:
    As alternative to JSON, you can now select to set up BSON communication with rosbridge_server.
    Make sure to activate bson_only_mode when launching ros_bridge_server as explained here.

The attached binaries are:

  • RosSharp.unitypackage : complete ROS# Unity Package containing all assets of the Unity3D project
  • RosBridgeClient.dll: the build of RosBridgeClient project
  • Urdf.dll: the build of Urdf project

ROS# Version 1.4.0

20 Dec 09:40
Compare
Choose a tag to compare

This version gives you the possibility to create, modify and export your URDF models with all comforts of the Unity Editor!

The biggest changes since Version 1.3 are:

  • Urdf Libary: The UrdfImporter project was renamed to Urdf. It now supports the ability to both read from and write to URDF files.
  • Create, Modify, and Export URDF models in Unity: ROS# now supports creating and exporting URDF models directly in Unity. It is also possible to modify and re-export an existing URDF model.
  • Transfer URDF files from Unity to ROS: Previously it was only possible to transfer/import URDF files from ROS to Unity. Now ROS# can send a URDF and all its meshes from Unity to a package in ROS.
    Please see the Wiki, especially Section 3.2, for further info.

The attached binaries are:

  • RosSharp.unitypackage : complete ROS# Unity Package containing all assets of the Unity3D project
  • RosBridgeClient.dll: the build of RosBridgeClient project
  • Urdf.dll: the build of Urdf project

ROS# Version 1.3.0

13 Sep 14:45
Compare
Choose a tag to compare

This version comes with the following changes in RosBridgeClient as discussed in Issue #59:

  • Generic Communication Protocol Interface: an interface to the communication protocol used by RosBridgeClient. It currently comes with two implementations: WebSocketNetProtocol and WebSocketSharpProtocol
  • Message Type Structure: a more ROS-oriented structure of message types, including further code simplifications
  • Simplified Message Handling in Unity: a simplified structure with even better performance. It requires a different placement of ROS# components in Unity scene.

Please see the Wiki and the videos of UnitySimulationScene and GazeboSimulationScene for a detailed info on how to use the new framework.

The attached binaries are:

  • RosSharp.unitypackage : complete ROS# Unity Package containing all assets of the Unity3D project
  • RosBridgeClient.dll: the build of RosBridgeClient project
  • UrdfImporter.dll: the build of UrdfImporter project

ROS# Version 1.2.3

23 Jul 14:24
Compare
Choose a tag to compare

This version is is the final state of ROS# before a major change in RosBridgeClient (cf. #59 ).
Please refer to this release and/or the corresponding commit if you want to continue working with the old framework.

The attached binaries are:

  • RosSharp.unitypackage: complete ROS# Unity Package containing all assets of the Unity3D project
  • RosBridgeClient.dll: the build of RosBridgeClient project
    UrdfImporter.dll: the build of UrdfImporter project

ROS# Version 1.2.2

04 Jun 14:54
Compare
Choose a tag to compare

This version includes a bunch of minor fixes that we found since release 1.2a.

The attached binaries are:

  • RosSharp.unitypackage: complete ROS# Unity Package containing all assets of the Unity3D project
  • RosBridgeClient.dll: the build of RosBridgeClient project
  • UrdfImporter.dll: the build of UrdfImporter project

ROS# Version 1.2.1

05 Apr 10:14
Compare
Choose a tag to compare

This version includes a bunch of minor fixes that we found since Pre-release 1.2.

The attached binaries are

ROS# Version 1.2.0

09 Mar 16:34
b36dcfb
Compare
Choose a tag to compare
ROS# Version 1.2.0 Pre-release
Pre-release

This version contains the new ROS# message handling framework.

The attached binaries are

ROS# Version 1.1.1

13 Feb 08:42
Compare
Choose a tag to compare

This version contains various fixes, code improvements and new features that we identified and realized in the past months. It seems pretty stable (considering the issue board and our ROS# application experience).

The attached binaries are:

  • RosSharp.unitypackage: complete ROS# Unity Package containing all Unity-specific C# scripts and Libraries/Plugins, basically what is in the Unity3D Unity project folder
  • RosBridgeClient.dll: the build of RosBridgeClient project
  • UrdfImporter.dll: the build of UrdfImporter project