Highlights
-
Citadel
/Edifice
/Fortress
: All Ignition Math classes can now be used in Python scripts! See the tutorial to get started!from ignition.math import DiffDriveOdometry, PID, MassMatrix3d, SphericalCoordinates, Kmeans, etc!
-
Fortress
: Support for waves on Ignition Rendering -
Fortress
: Trajectory follower plugin on Gazebo. The trajectory is performed by applying forces and torques to a link. -
Fortress
: Elevator plugin that accepts commands through Ignition Transport -
Fortress
: Support for visual plugins on Gazebo’s GUI, and a shader param plugin -
Fortress
: Support for barrel and pincushion camera distortions
Releases
These are the minor and patch releases that came out since the previous post.
Ignition CMake 2.11.0 (Citadel, Edifice, Fortress)
Changelog
- Set source path to be used by
common::testing
- Add examples using static libraries
Contributors
Michael Carroll
Steve Peters
Ignition Math 6.10.0 (Citadel, Edifice, Fortress)
Changelog
- Documentation updates
- Small fixes in doxygen
- Document that Euler angles should be in radians for quaternion constructor
- Internal URL fixed (paragraph 266)
- Added tutorials for vector, angle, triangle and rotation
- Examples
- kmeans example in C++ and Python
- Add example and modify documentation for class Color
- quaternion_from_euler example: input degrees
- Use
const
instead ofconstexpr
in Ellipsoid constructor - Fix Focal on Jenkins
- Fix Color::HSV() incorrect hue output
- Fix windows warnings in Vector2, 3 and 4
- AxisAlignedBox: deprecate unimplemented methods
- Python interfaces
- Refactor finding
pybind11
- Move SWIG interfaces from Python to Ruby
- Modified CMake target name for Ruby interfaces
- Added Python Getting started tutorial
- Added pybind11 interfaces for various classes
- Angle
- AxisAlignedBox
- Box
- Color
- Cylinder
- DiffDriveOdometry (with examples)
- Filter
- Frustum
- GaussMarkovProcess (with examples)
- Helpers
- Inertial
- Kmeans
- Line2
- Line3
- MassMatrix3
- Material
- Matrix3
- Matrix4
- MovingWindowFilter
- OrientedBox
- PID
- Plane
- Pose3
- Quaternion
- Rand (with examples)
- RollingMean
- RotationSpline
- SemanticVersion
- SignalStats
- Sphere
- SphericalCoordinates
- Spline
- StopWatch
- Temperature
- Triangle
- Triangle3
- Vector2, Vector3 and Vector4
- Vector3Stats
- Refactor finding
Contributors
Alejandro Hernández Cordero
Ashton Larkin
AzulRadio
Darío Hereñú
Louise Poubel
Steve Peters
Ignition Utils 1.2.0 and 1.3.0 (Edifice, Fortress)
Changelog
- Fix inline namespace issue with clang6
- Move
ExtraTestMacros
from ign-cmake - Enable cpplint on Focal
- Add
NeverDestroyed
utility class - Move environment functionality to utils
-
ImplPtr
Get
method
Contributors
Addisu Z. Taddese
Louise Poubel
Michael Carroll
Nate Koenig
Ignition GUI 5.4.0 (Edifice)
Changelog
- Improve inserting
WorldControl
andWorldStats
from menu - Added a button that allows shutting down both the client and server.
- Prevent
Scene3D
if another scene is already loaded - Add
project()
to examples and remove hard-dependency on Ogre1 - Fix codecheck
- Use
qmldir
to define QML module withIgnSpinBox
- Fix
TopicEcho
plugin message display - Don’t crash if a plugin has invalid QML
- Added log storing for ign-gui
Contributors
Jenn Nguyen
Louise Poubel
Martin Pecka
Nikhil Nair
Rhys Mainwaring
Will
Ignition GUI 6.4.0 (Fortress)
Changelog
- Improve inserting
WorldControl
andWorldStats
from menu - Added a button that allows shutting down both the client and server.
- Prevent
Scene3D
if another scene is already loaded - Add
project()
to examples and remove hard-dependency on Ogre1
Contributors
Jenn Nguyen
Louise Poubel
Martin Pecka
Ignition Rendering 6.2.0 and 6.2.1 (Fortress)
Changelog
- Restore format conversion in
Ogre2RenderTarget::Copy
- Increase particle emitter quota
-
Pull request #562
1.Make sure shader param exists before setting its value - Pull request #558
-
Pull request #562
- Fix missing terrain shadows casted on objects
- Add waves
- Fix crash when hovering the cursor in
heightmap.sdf
- Fix material switching for objects using shaders (ogre2)
- [Metal] Fix depth camera
- Pull request #535
- A contribution from Rhys Mainwaring rhys.mainwaring@me.com
- Bind shader uniforms to constants from ogre
- Silence CMake policy CMP0072
- Fix various issues with
Ogre2GpuRays
- Fix
Ogre2ThermalCamera
using garbage depth data - Performance optimization by avoiding unnecessary passes
- Support using custom shader materials and updating uniform variables (ogre2)
- Port Camera Distortion effect from gazebo11
- Fix sky background in RGBD camera
-
RenderOrder
is in different scale in Reverse Z
Contributors
Ian Chen
Jose Luis Rivero
Louise Poubel
Matias N. Goldberg
Rhys Mainwaring
Steve Peters
William Lew
Ignition Gazebo 6.5.0 and 6.6.0 (Fortress)
Changelog
- Fix accessing empty
JointPosition
component in lift drag plugin - Support disabling pose publisher from publishing top level model pose
- Added more sensor properties to
scene/info
topic - Buoyancy: logs a warning if a mode is not clearly specified.
-
JointStatePublisher
publish parent, child and axis data - Fixed light GUI component inspector
- Fix
UNIT_SdfGenerator_TEST
- Add elevator system
- Removed unused variables in shapes plugin
- New trajectory follower system
- Extend
ShaderParam
system to support textures - Adds a
Link::SetLinearVelocity()
method - Fix weird indentation in
Link.hh
- Limit thruster system’s input thrust cmd
- Load and run visual plugin (system) on GUI side
- Log an error if
JointPositionController
cannot find the joint - Update source install instructions
- Document the
<topic>
option forJointPositionController
. - Fix typo in
EntityComponentManager
- Buoyancy: fix center of volume’s reference frame
- Fix graded buoyancy problems
- Add surface to buoyancy engine
- Remove
EachNew
calls from sensorPreUpdates
- Prevent
GzScene3D
if another scene is already loaded - Fix various typos on API documentation
- Optional orientation when spawning entity using spherical coordinates
- Cleanup update call for non-rendering sensors
- Documentation Error
- Min and max parameters for velocity, acceleration, and jerk apply to linear and angular separately.
- Add
project()
call to examples - Implement
/server_control::stop
Contributors
Alejandro Hernández Cordero
Arjo Chakravarty
Carlos Agüero
Harsh Mahesheka
Ian Chen
Jose Luis Rivero
Louise Poubel
Martin Pecka
Michael Carroll
Nate Koenig
Nick Lamprianidis
roni-kreinin
Sicong (Anson) Wang
Tomoya Fujita