Skip to content

Releases: google-deepmind/mujoco

2.3.7

20 Jul 09:56
Compare
Choose a tag to compare

General

  1. Added primitive collider for sphere-cylinder contacts, previously this pair used the generic convex-convex collider.
  2. Added joint-actuatorforcerange for clamping total actuator force at joints and sensor-jointactuatorfrc<sensor-jointactuatorfrc> for measuring total actuation force applied at a joint. The most important use case for joint-level actuator force clamping is to ensure that Cartesian actuator forces are realizable by individual motors at the joints. See Actuator force clamping for details.
  3. Added an optional content_type attribute to hfield, texture, and mesh assets. This attribute supports a formatted Media Type (previously known as MIME type) string used to determine the type of the asset file without resorting to pulling the type from the file extension.
  4. Added analytic derivatives for quaternion subtraction and integration (rotation with an angular velocity). Derivatives are in the 3D tangent space.
  5. Added mjv_connector which has identical functionality to mjv_makeConnector, but with more convenient "from-to" argument parametrization. mjv_makeConnector is now deprecated.
  6. Bumped oldest supported MacOS from version 10.12 to 11. MacOS 11 is the oldest version still maintained by Apple.

Python bindings

  1. The passive viewer handle now exposes update_hfield, update_mesh, and update_texture methods to allow users to update renderable assets. (#812 , #958, #965)
  2. Allow a custom keyboard event callback to be specified in the passive viewer. (#766)
  3. Fix GLFW crash when Python exits while the passive viewer is running. (#790)

Models

  1. Added simple car example model.

2.3.6

20 Jun 18:05
Compare
Choose a tag to compare

NOTE: MuJoCo 2.3.6 is the last version to officially support Python 3.7.

Models

  1. Added 3x3x3 cube example model. See README for details.

Bug fixes

  1. Fixed a bug that was causing an incorrect computation of the mesh bounding box and coordinate frame if the volume was invalid. In such case, now MuJoCo only accepts a non-watertight geometry if shellinertia is equal to true.
  2. Fixed the sparse Jacobian multiplication logic that is used to compute derivatives for tendon damping and fluid force, which affects the behaviour of the implicit and implicitfast integrators.
  3. Fixes to mj_ray, in line with geom visualisation conventions:
    • Planes and height-fields respect the geom_group and flg_static arguments. Before this change, rays would intersect planes and height-fields unconditionally.
    • flg_static now applies to all static geoms, not just those which are direct children of the world body.

Plugins

  1. Added touch-grid sensor plugin. See documentation for details, and associated touch_grid.xml example model. The plugin includes in-scene visualisation.
  2. Added Visualization tab to simulate UI, corresponding to elements of the visual MJCF element. After modifying values in the GUI, a saved XML will contain the new values. The modifiable members of mjStatistic (extent, meansize and center) are computed by the compiler and therefore do not have defaults. In order for these attributes to appear in the saved XML, a value must be specified in the loaded XML.
  3. Increased text width for UI elements in the default spacing.

General

  1. Added mj_getState and mj_setState for getting and setting the simulation state as a concatenated vector of floating point numbers. See the State section for details.
  2. Added mjContact.solreffriction, allowing different solref parameters for the normal and frictional axes of contacts when using elliptic friction cones. This attribute is required for elastic frictional collisions, see associated example model mimicking the spin-bounce recoil behaviour of elastic rubber balls. This is an advanced option currently only supported by explicit contact pairs, using the solreffriction attribute.
  3. Added mjd_inverseFD for finite-differenced inverse-dynamics derivatives.
  4. Added functions for operations on banded-then-dense “arrowhead” matrices. Such matrices are common when doing direct trajectory optimization. See mju_cholFactorBand documentation for details.
  5. Added mj_multiRay function for intersecting multiple rays emanating from a single point. This is significantly faster than calling mj_ray multiple times.
  6. Ray-mesh collisions are now up to 10x faster, using a bounding volume hierarchy of mesh faces.
  7. Increased mjMAXUIITEM (maximum number of UI elements per section in Simulate) to 100.
  8. Added documentation for resource providers.
  9. Changed the formula for mju_sigmoid, a finite-support sigmoid $s: \mathbf{R} \rightarrow [0, 1]$. Previously, the smooth part consisted of two stitched quadratics, once continuously differentiable. It is now a single quintic, twice continuously differentiable:

$$ s(x) = \begin{cases} 0, & & x \le 0 \\ 6x^5 - 15x^4 + 10x^3, & 0 \lt & x \lt 1 \\ 1, & 1 \le & x \qquad \end{cases} $$

  1. Added optional tausmooth attribute to muscle actuators. When positive, the time-constant $\tau$ of muscle activation/deactivation uses mju_sigmoid to transition smoothly between the two extremal values given by the Millard et al. (2013) muscle model, within a range of width tausmooth. See Muscle actuators for more details. Relatedly, mju_muscleDynamics now takes 3 parameters instead of 2, adding the new smoothing-width parameter.
  2. Moved public C macro definitions out of mujoco.h into a new public header file called mjmacro.h. The new file is included by mujoco.h so this change does not break existing user code.
  3. Added instrumentation for the Address Sanitizer (ASAN) and Memory Sanitizer (MSAN) to detect memory bugs when allocating from the mjData stack and arena.
  4. Removed pstack and parena from the output of mj_printData, since these are implementation details of the mjData allocators that are affected by diagnostic paddings in instrumented builds.
  5. Removed the mj_activate and mj_deactivate functions. These had been kept around for compatibility with old user code from when MuJoCo was closed source, but have been no-op functions since open sourcing.

2.3.5

25 Apr 16:27
Compare
Choose a tag to compare

Bug fixes

  1. Fix asset loading bug that prevented OBJ and PNG files from being read from disk when mjVFS is used.

  2. Fix occasional segmentation faults on macOS when mouse perturbations are applied in the Python passive viewer.

Plugins

  1. The visualize callback in mjpPlugin now receives an mjvOption as an input argument.

2.3.4

20 Apr 16:56
Compare
Choose a tag to compare

24 April 2023: This version is affected by an asset loading bug that prevents OBJ and PNG files from being read from disk when mjVFS is used. Users are advised to skip to version 2.3.5 instead.

General

  1. Removed the "global" setting of the compiler/coordinate attribute. This rarely-used setting complicates the compiler logic and is blocking future improvements. In order to convert older models which used this option, load and save them in MuJoCo 2.3.3 or older.
  2. Added visual-global flag ellipsoidinertia to visualize equivalent body inertias with ellipsoids instead of the default boxes.
  3. Added midphase and broadphase collision statistics to mjData.
  4. Added documentation for engine plugins.
  5. Added struct information to the introspect module.
  6. Added a new extension mechanism called "resource provider" . This extensible mechanism allows MuJoCo to read assets from data sources other than the local OS filesystem or the Virtual file system.

Python bindings

  1. Offscreen rendering on macOS is no longer restricted to the main thread. This is achieved by using the low-level Core OpenGL (CGL) API to create the OpenGL context, rather than going via GLFW which relies on Cocoa's NSOpenGL. The resulting context is not tied to a Cocoa window, and is therefore not tied to the main thread.
  2. Fixed a race condition in viewer.launch_passive and viewer.launch_repl. These functions could previously return before an internal call to mj_forward. This allows user code to continue and potentially modify physics state concurrently with the internal mj_forward, resulting in e.g. MuJoCo stack overflow error or segmentation fault.
  3. The viewer.launch_passive function now returns a handle which can be used to interact with the viewer. The passive viewer now also requires an explicit call to sync on its handle to pick up any update to the physics state. This is to avoid race conditions that can result in visual artifacts. See documentation for details.
  4. The viewer.launch_repl function has been removed since its functionality is superceded by launch_passive.
  5. Added a small number of missing struct fields discovered through the new introspect metadata.

Bug fixes

  1. Fixed bug in the handling of ellipsoid-based fluid model forces in the new implicitfast integrator.
  2. Removed spurious whole-arena copying in mj_copyData, which can considerably slow down the copying operation (#568).
  3. Make shellinertia ignore exactmeshinertia, which is only used for legacy volume computations (#759).

2.3.3

20 Mar 18:44
Compare
Choose a tag to compare

General

  1. Improvements to implicit integration:

    • The derivatives of the RNE algorithm are now computed using sparse math, leading to significant speed improvements for large models when using the implicit integrator.
    • A new integrator called implicitfast was added. It is similar to the existing implicit integrator, but skips the derivatives of Coriolis and centripetal forces. See the numerical integration section for a detailed motivation and discussion. The implicitfast integrator is recommended for all new models and will become the default integrator in a future version.

    The table below shows the compute cost of the 627-DoF humanoid100 model using different integrators. "implicit (old)" uses dense RNE derivatives, "implicit (new)" is after the sparsification mentioned above. Timings were measured on a single core of an AMD 3995WX CPU.

timing Euler implicitfast implicit (new) implicit (old)
one step (ms) 0.5 0.53 0.77 5.0
steps/second 2000 1900 1300 200

Animation showing bounding volume hierarchy for humanoid and many small boxes

  1. Added a collision mid-phase for pruning geoms in body pairs, see documentation for more details.
    This is based on static AABB bounding volume hierarchy (a BVH binary tree) in the body inertial frame. The GIF on the right is cut from this longer video.
  2. The mjd_transitionFD function no longer triggers sensor calculation unless explicitly requested.
  3. Corrected the spelling of the inteval attribute to interval in the mjLROpt struct.
  4. Mesh texture and normal mappings are now 3-per-triangle rather than 1-per-vertex. Mesh vertices are no longer duplicated in order to circumvent this limitation as they previously were.
  5. The non-zeros for the sparse constraint Jacobian matrix are now precounted and used for matrix memory allocation.
    For instance, the constraint Jacobian matrix from the humanoid100 model, which previously required ~500,000 mjtNums, now only requires ~6000. Very large models can now load and run with the CG solver.
  6. Modified mju_error and mju_warning to be variadic functions (support for printf-like arguments). The functions mju_error_i, mju_error_s, mju_warning_i, and mju_warning_s are now deprecated.
  7. Implemented a performant mju_sqrMatTDSparse function that doesn't require dense memory allocation.
  8. Added mj_stackAllocInt to get correct size for allocating ints on mjData stack. Reducing stack memory usage by 10% - 15%.

Python bindings

  1. Fixed IPython history corruption when using viewer.launch_repl. The launch_repl function now provides seamless continuation of an IPython interactive shell session, and is no longer considered experimental feature.
  2. Added viewer.launch_passive which launches the interactive viewer in a passive, non-blocking mode. Calls to launch_passive return immediately, allowing user code to continue execution, with the viewer automatically reflecting any changes to the physics state. (Note that this functionality is currently in experimental/beta stage, and is not yet described in our viewer documentation.)
  3. Added the mjpython launcher for macOS, which is required for viewer.launch_passive to function there.
  4. Removed efc_ fields from joint indexers. Since the introduction of arena memory, these fields now have dynamic sizes that change between time steps depending on the number of active constraints, breaking strict correspondence between joints and efc_ rows.
  5. Added a number of missing fields to the bindings of mjVisual and mjvPerturb structs.

Simulate

Screenshot of simulate showing labels for contacts

  1. Implemented a workaround for broken VSync on macOS so that the frame rate is correctly capped when the Vertical Sync toggle is enabled.

  2. Added optional labels to contact visualization, indicating which two geoms are contacting (names if defined, ids otherwise). This can be useful in cluttered scenes.

2.3.2

07 Feb 15:46
Compare
Choose a tag to compare

General

  1. A more performant mju_transposeSparse has been implemented that doesn't require dense memory allocation. For a constraint Jacobian matrix from the humanoid100.xml model, this function is 35% faster.
  2. The function mj_name2id is now implemented using a hash function instead of a linear search for better performance.
  3. Geom names are now parsed from URDF. Any duplicate names are ignored. mj_printData output now contains contacting geom names.

Bug fixes

  1. Fixed a bug that for shellinertia equal to true caused the mesh orientation to be overwritten by the principal components of the shell inertia, while the vertex coordinates are rotated using the volumetric inertia. Now the volumetric inertia orientation is used also in the shell case.
  2. Fixed misalignment bug in mesh-to-primitive fitting when using the bounding box fitting option fitaabb.
  3. The launch_repl functionality in the Python viewer has been fixed.
  4. Set time correctly in mjd_transitionFD, to support time-dependent user code.
  5. Fixed sensor data dimension validation when user type sensors are present.
  6. Fixed incorrect plugin error message when a null nsensordata callback is encountered during model compilation.
  7. Correctly end the timer (TM_END) mj_fwdConstraint returns early.
  8. Fixed an infinite loop in mj_deleteFileVFS.

Simulate

  1. Increased precision of simulate sensor plot y-axis by 1 digit #719.
  2. Body labels are now drawn at the body frame rather than inertial frame, unless inertia is being visualised.

Plugins

  1. The reset callback now receives instance-specific plugin_state and plugin_data as arguments, rather than the entire mjData. Since reset is called inside mj_resetData before any physics forwarding call has been made, it is an error to read anything from mjData at this stage.
  2. The capabilities field in mjpPlugin is renamed capabilityflags to more clearly indicate that this is a bit field.

2.3.1

06 Dec 13:21
Compare
Choose a tag to compare

Python bindings

  1. The simulate GUI is now available through the mujoco Python package as mujoco.viewer. See documentation for details. (Contribution by Levi Burner.)
  2. The Renderer class from the MuJoCo tutorial Colab is now available directly in the native Python bindings.

General

  1. The tendon springlength attribute can now take two values. Given two non-decreasing values, springlength specifies a deadband range for spring stiffness. If the tendon length is between the two values, the force is 0. If length is outside this range, the force behaves like a regular spring, with the spring resting length corresponding to the nearest springlength value. This can be used to create tendons whose limits are enforced by springs rather than constraints, which are cheaper and easier to analyse. See tendon_springlength.xml example model. This is a minor breaking API change. mjModel.tendon_lengthspring now has size ntendon x 2 rather than ntendon x 1.

  2. Removed the requirement that stateless actuators come before stateful actuators.

  3. Added mju_fill, mju_symmetrize and mju_eye utility functions.

  4. Added gravcomp attribute to body implementing gravity compensation and buoyancy. See balloons.xml example model.

  5. Renamed the cable plugin library to elasticity.

  6. Added actdim attribute to general actuators. Values greater than 1 are only allowed for user, as native activation dynamics are all scalar. Added example test implementing 2nd-order activation dynamics to engine_forward_test.cc.

  7. Improved particle composite type, which now permits a user-specified geometry and multiple joints. See the two new examples: particle_free.xml and particle_free2d.xml.

  8. Performance improvements for non-AVX configurations:

  9. Added new solid passive force plugin.

    • This is new force field compatible with the composite particles.
    • Generates a tetrahedral mesh having particles with mass concentrated at vertices.
    • Uses a piecewise-constant strain model equivalent to finite elements but expressed in a coordinate-free
      formulation. This implies that all quantities can be precomputed except edge elongation, as in a mass-spring model.
    • Only suitable for small strains (large displacements but small deformations). Tetrahedra may invert if subject to
      large loads.
  10. Added API functions mj_loadPluginLibrary and mj_loadAllPluginLibraries. The first function is identical to dlopen on a POSIX system, and to LoadLibraryA on Windows. The second function scans a specified directory for all dynamic libraries file and loads each library found. Dynamic libraries opened by these functions are assumed to register one or more MuJoCo plugins on load.

  11. Added an optional visualize callback to plugins, which is called during mjv_updateScene. This callback allows custom plugin visualizations. Enable stress visualization for the Cable plugin as an example.

  12. Sensors of type user no longer require objtype, objname and needstage. If unspecified, the objtype is now mjOBJ_UNKNOWN. user sensors datatype default is now real, needstage default is now acc.

  13. Added support for capsules in URDF import.

  14. On macOS, issue an informative error message when run under Rosetta 2 translation on an Apple Silicon machine. Pre-built MuJoCo binaries make use of AVX instructions on x86-64 machines, which is not supported by Rosetta 2. (Before this version, users only get a cryptic "Illegal instruction" message.)

Bug fixes

  1. Fixed bug in mj_addFileVFS that was causing the file path to be ignored (introduced in 2.1.4).

Simulate

  1. Renamed the directory in which the simulate application searches for plugins from plugin to mujoco_plugin.
  2. Mouse force perturbations are now applied at the selection point rather than the body center of mass.

Python bindings 2.3.1.post1 (6 December 2022)

  • Fix type annotations in mujoco.viewer that were causing errors in Python 3.7 and 3.8.

2.3.0

18 Oct 10:38
Compare
Choose a tag to compare

General

  1. The contact array and arrays prefixed with efc_ in mjData were moved out of the buffer into a new arena memory space. These arrays are no longer allocated with fixed sizes when mjData is created. Instead, the exact memory requirement is determined during each call to mj_forward (specifically, in mj_collision and mj_makeConstraint) and the arrays are allocated from the arena space. The stack now also shares its available memory with arena. This change reduces the memory footprint of mjData in models that do not use the PGS solver, and will allow for significant memory reductions in the future. See the Memory allocation section for details.

  2. Added colab notebook tutorial showing how to balance the humanoid on one leg with a Linear Quadratic Regulator. The
    notebook uses MuJoCo's native Python bindings, and includes a draft Renderer class, for easy rendering in Python. Try it yourself: Open In Colab

  3. Updates to humanoid model:

    • Added two keyframes (stand-on-one-leg and squat).
    • Increased maximum hip flexion angle.
    • Added hamstring tendons which couple the hip and knee at high hip flexion angles.
    • General cosmetic improvements, including improved use of defaults and better naming scheme.
  4. Added mju_boxQP and allocation function mju_boxQPmalloc for solving the box-constrained Quadratic Program: $x^* = \text{argmin} ; \tfrac{1}{2} x^T H x + x^T g \quad \text{s.t.} \quad l \le x \le u$ The algorithm, introduced in Tassa et al. 2014, converges after 2-5 Cholesky factorisations, independent of problem size.

  5. Added mju_mulVecMatVec to multiply a square matrix $M$ with vectors $x$ and $y$ on both sides. The function returns $x^TMy$.

  6. Added new plugin API. Plugins allow developers to extend MuJoCo's capability without modifying core engine code. The plugin mechanism is intended to replace the existing callbacks, though these will remain for the time being as an option for simple use cases and backward compatibility. The new mechanism manages stateful plugins and supports multiple plugins from different sources, allowing MuJoCo extensions to be introduced in a modular fashion, rather than as global overrides. Note the new mechanism is currently undocumented except in code, as we test it internally. If you are interested in using the plugin mechanism, please get in touch first.

  7. Added assetdir compiler option, which sets the values of both meshdir and texturedir. Values in the latter attributes take precedence over assetdir.

  8. Added realtime option to visual for starting a simulation at a slower speed.

  9. Added new cable composite type:

    • Cable elements are connected with ball joints.
    • The initial parameter specifies the joint at the starting boundary: free, ball, or none.
    • The boundary bodies are exposed with the names B_left and B_right.
    • The vertex initial positions can be specified directly in the XML with the parameter vertex.
    • The orientation of the body frame is the orientation of the material frame of the curve.
  10. Added new cable passive force plugin:

    • Twist and bending stiffness can be set separately with the parameters twist and bend.
    • The stress-free configuration can be set to be the initial one or flat with the flag flat.
    • New cable.xml example showing the formation of plectoneme.
    • New coil.xml example showing a curved equilibrium configuration.
    • New belt.xml example showing interaction between twist and anisotropy.
    • Added test using cantilever exact solution.

Python bindings

  1. Added id and name properties to named accessor objects. These provide more Pythonic API access to mj_name2id and mj_id2name respectively.

  2. The length of MjData.contact is now ncon rather than nconmax, allowing it to be straightforwardly used as
    an iterator without needing to check ncon.

  3. Fix a memory leak when a Python callable is installed as callback (#527).

2.2.2

07 Sep 12:30
Compare
Choose a tag to compare

General

  1. Added adhesion actuators mimicking vacuum grippers and adhesive biomechanical appendages.

  2. Added related example model and video.

  3. Added mj_jacSubtreeCom for computing the translational Jacobian of the center-of-mass of a subtree.

  4. Added torquescale and anchor attributes to weld constraints. torquescale sets the torque-to-force ratio exerted by the constraint, anchor sets the point at which the weld wrench is applied. See weld for more details.

  5. Increased mjNEQDATA, the row length of equality constraint parameters in mjModel.eq_data, from 7 to 11.

  6. Added visualisation of anchor points for both connect and weld constraints (activated by the 'N' key in simulate).

  7. Added weld.xml showing different uses of new weld attributes.

  8. Cartesian 6D end-effector control is now possible by adding a reference site to actuators with site transmission. See description of new refsite attribute in the actuator documentation and refsite.xml example model. Video

  9. Added autolimits compiler option. If true, joint and tendon limited attributes and actuator ctrllimited, forcelimited and actlimited attributes will automatically be set to true if the corresponding range is defined and false otherwise.

    If autolimits="false" (the default) models where a range attribute is specified without the limited attribute will fail to compile. A future release will change the default of autolimits to true, and this compilation error allows users to catch this future change of behavior.

    This is a breaking change. In models where a range was defined but limited was unspecified, explicitly set limited to false or remove the range to maintain the current behavior of your model.

  10. Added moment of inertia computation for all well-formed meshes. This option is activated by setting the compiler flag exactmeshinertia to true (defaults to false). This default may change in the future.

  11. Added parameter shellinertia to geom, for locating the inferred inertia on the boundary (shell). Currently only meshes are supported.

  12. For meshes from which volumetric inertia is inferred, raise error if the orientation of mesh faces is not consistent. If this occurs, fix the mesh in e.g., MeshLab or Blender.

  13. Added catenary visualisation for hanging tendons. The model seen in the video can be found here.

  14. Added azimuth and elevation attributes to visual/global, defining the initial orientation of the free camera at model load time.

  15. Added mjv_defaultFreeCamera which sets the default free camera, respecting the above attributes.

  16. simulate now supports taking a screenshot via a button in the File section or via Ctrl-P.

  17. Improvements to time synchronisation in simulate, in particular report actual real-time factor if different from requested factor (if e.g., the timestep is so small that simulation cannot keep up with real-time).

  18. Added a disable flag for sensors.

  19. mju_mulQuat and mju_mulQuatAxis support in place computation. For example mju_mulQuat(a, a, b); sets the quaternion a equal to the product of a and b.

  20. Added sensor matrices to mjd_transitionFD (note this is an API change).

Deleted/deprecated features

  1. Removed distance constraints.

Bug fixes

  1. Fixed rendering of some transparent geoms in reflection.
  2. Fixed intvelocity defaults parsing.

2.2.1

17 Jul 17:25
Compare
Choose a tag to compare

General

  1. Added mjd_transitionFD to compute efficient finite difference approximations of the state-transition and control-transition matrices, see here for more details.
  2. Added derivatives for the ellipsoid fluid model.
  3. Added ctrl attribute to keyframes.
  4. Added clock sensor which measures time.
  5. Added visualisation groups to skins.
  6. Added actuator visualisation for free and ball joints and for actuators with site transmission.
  7. Added visualisation for actuator activations.
  8. Added <intvelocity> actuator shortcut for "integrated velocity" actuators, documented here.
  9. Added <damper> actuator shortcut for active-damping actuators, documented here.
  10. mju_rotVecMat and mju_rotVecMatT now support in-place multiplication.
  11. mjData.ctrl values are no longer clamped in-place, remain untouched by the engine.
  12. Arrays in mjData's buffer now align to 64-byte boundaries rather than 8-byte.
  13. Add memory poisoning when building with Address Sanitizer (ASAN) and Memory Sanitizer (MSAN). This allows ASAN to detect reads and writes to regions in mjModel.buffer and mjData.buffer that do not lie within an array, and for MSAN to detect reads from uninitialised fields in mjData following mj_resetData.
  14. Add a slider-crank example to model/.

Bug fixes

  1. Activation clamping was not being applied in the implicit integrator.
  2. Stricter parsing of orientation specifiers. Before this change, a specification that included both quat and an alternative specifier e.g., <geom ... quat=".1 .2 .3 .4" euler="10 20 30">, would lead to the quat being ignored and only euler being used. After this change a parse error will be thrown.
  3. Stricter parsing of XML attributes. Before this change an erroneous XML snippet like <geom size="1/2 3 4"> would have been parsed as size="1 0 0" and no error would have been thrown. Now throws an error.
  4. Trying to load a NaN via XML like <geom size="1 NaN 4">, while allowed for debugging purposes, will now print a warning.
  5. Fixed null pointer dereference in mj_loadModel.
  6. Fixed memory leaks when loading an invalid model from MJB.
  7. Integer overflows are now avoided when computing mjModel buffer sizes.
  8. Added missing warning string for mjWARN_BADCTRL.

Packaging

  1. Changed MacOS packaging so that the copy of mujoco.framework embedded in MuJoCo.app can be used to build applications externally.