This page lists changes that were made in the 1.2.x series of simulator_gazebo (C Turtle, Diamondback).

1.2.9 (Forthcoming)

1.2.8 (2010-12-16)

  • gazebo

    • update parallel_quickstep hookups in CMakeLists.txt
    • <<Ticket(ros-pkg #4411)>>

    • bounding box visual offset fix
    • kill gazebo if still running when starting a new server, proceed normally if pid does not refer to a live process
  • gazebo_plugins

    • <<Ticket(ros-pkg #4418)>>

    • <<Ticket(ros-pkg #4456)>>

1.2.7 (2010-11-22)

  • add stack level dependency on ros_comm
  • gazebo

    • change from roslib/Header.h to std_msgs/Header.h for ROS >= 1.3.1

  • gazebo_plugins

    • update per CameraInfo message distortion information changes.

1.2.6 (2010-11-13)

1.2.5 (2010-10-15)

  • gazebo_tools

    • adding deprecation warning for gazebo_model
  • gazebo

    • fix setModelPose relative pose calculation.
    • <<Ticket(ros-pkg 4480)>> for Ubuntu 10.10 Meerkat

    • cleanup default world files
    • remove debug messages
    • <<Ticket(ros-pkg 4469)>>, fix relative contact pose/normal calculation error

1.2.4 (2010-09-15)

  • gazebo

    • create and update default build from tarball

    • added temporary textures for WG COLLADA model.
    • update to r8902 in gazebo repo.
    • synchronized camera update. keep rendering time.
    • fix OgreAdaptor destruction error due to uninitialized frameListener

    • accessors for controller and sensor update rate settings
    • renamed gazebo_camera_synchronizer.cpp to vision_reconfigure.cpp
    • increased text buffer for new models by a factor of 10
    • catch and avoid segfault when selecting model using gui in wg_collada world. For some reason OgreCreator::GetMeshInformation(...) returns bad indices.

  • gazebo_plugins

    • publish camera message with render time instead of publish time.
    • fix boost segfaults on exit.

1.2.3 (2010-08-20)

  • gazebo

    • add option to spawn_model script to unpause on spawn
    • Fix GetModelState to actually use relative_entity_name for pose/twist returns

    • pass along genTexCoord gazebo tag from urdf to gazebo xml
    • push local patches into gazebo trunk. fixed contact visuals.
  • gazebo_worlds

    • switching default launch scripts from gazebo_model to spawn_model
    • adding the drill object
  • gazebo_tools

    • pass along genTexCoord gazebo tag from urdf to gazebo xml

1.2.2 (2010-07-31)

  • gazebo

    • fix fltk compile on gentoo <<Ticket(ros-pkg 4310)>>

1.2.1 (2010-07-24)

1.2.0 (2010-07-22)

Major updates since 1.0 release:

  • gazebo

    • gazebo continues even if loading controller plugins fails
    • get ready to switch xml tags
      • Controller: alwaysOn->alwaysActive

      • Physics ODE: deprecate quickStep, quickStepIters, quickStepW

    • added camera synchronizer node, allowing turning on/off texture projector.
    • ignore .gazeborc if paths are set already. This fixes problem with ms_singleton in <<Ticket(ros-pkg 4090)>>

    • works with ode double precision
    • iface no longer mandatory for controller plugins
    • physics hooks for Get/Set physics properties
    • new ROS API

    • fixed semaphore bug <<Ticket(ros-pkg 3982)>> by making semaphores all rw-able.

    • new gazebomodel commandline interface
    • Fixed deletion of complex objects in gazebo #3976
    • <<Ticket(ros-pkg,4078)>> switch dInfinity to numeric_limits<double>::max to avoid spams by boost::lexical_cast

    • assimp based mesh loader (with Collada support).
    • Supports ODE and bullet physics engines.
    • Supports GPU shaders: per-vertex lighting, per-pixel lighting, normal and tangent maps.
  • gazebo_worlds

    • added yet another simple office world file
    • turn off shadow in default empty.world

    • added an elevator world
    • removing gazebo_ros_time plugin now that gazebo binary wraps ros and publishes clock,
    • added a shopping cart
  • gazebo_plugins

    • added new texture projector
    • added imu calibration service call, does nothing and returns true. (in support of simulating full robot startup calibration).
  • gazebo_tools

    • pass through joint damping to Gazebo XML

Wiki: simulator_gazebo/ChangeList/1.2 (last edited 2011-01-12 19:48:18 by KenConley)