Skip to content

Commit

Permalink
Browse files Browse the repository at this point in the history
  • Loading branch information
Jamie Snape committed Aug 3, 2018
1 parent 6506f62 commit a06b746
Show file tree
Hide file tree
Showing 88 changed files with 155 additions and 155 deletions.
6 changes: 3 additions & 3 deletions .github/issue_template.md
Original file line number Diff line number Diff line change
Expand Up @@ -4,7 +4,7 @@ to remove the quoted sections that do not need a response.
> Before you post:
> * Have you reviewed the documentation on
[Getting Help](http://drake.mit.edu/getting_help.html)?
[Getting Help](https://drake.mit.edu/getting_help.html)?
> * Have you reviewed existing GitHub issues and StackOverflow posts?
> * Have you rerun `install_prereqs.sh` on your current commit of `drake`?
Expand Down Expand Up @@ -72,7 +72,7 @@ external:
output.

* If you are building `drake`
[from source](http://drake.mit.edu/from_source.html):
[from source](https://drake.mit.edu/from_source.html):

* What git commit of `drake` are you using?

Expand All @@ -92,7 +92,7 @@ external:

> Replace this with your answer.

* If you are using `drake` [from a binary release](http://drake.mit.edu/from_binary.html):
* If you are using `drake` [from a binary release](https://drake.mit.edu/from_binary.html):

* What are the contents of `.../drake/share/doc/drake/VERSION.txt`?

Expand Down
2 changes: 1 addition & 1 deletion CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -229,7 +229,7 @@ else()

set(CPACK_DEBIAN_FILE_NAME DEB-DEFAULT)
set(CPACK_DEBIAN_PACKAGE_CONTROL_STRICT_PERMISSION ON)
set(CPACK_DEBIAN_PACKAGE_HOMEPAGE http://drake.mit.edu/)
set(CPACK_DEBIAN_PACKAGE_HOMEPAGE https://drake.mit.edu/)
set(CPACK_DEBIAN_PACKAGE_RELEASE 1)
set(CPACK_DEBIAN_PACKAGE_SECTION contrib/devel)

Expand Down
2 changes: 1 addition & 1 deletion CONTRIBUTING.md
Original file line number Diff line number Diff line change
Expand Up @@ -4,4 +4,4 @@ If you have improvements to Drake, send us your pull requests!

Please see our developer's page for details:
* `doc/developers.rst`
* [online version](http://drake.mit.edu/developers.html)
* [online version](https://drake.mit.edu/developers.html)
2 changes: 1 addition & 1 deletion CPPLINT.cfg
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
# Copyright 2016 Robot Locomotion Group @ CSAIL. All rights reserved.
#
# All components of Drake are licensed under the BSD 3-Clause License.
# See LICENSE.TXT or http://drake.mit.edu/ for details.
# See LICENSE.TXT or https://drake.mit.edu/ for details.

# Stop searching for additional config files.
set noparent
Expand Down
2 changes: 1 addition & 1 deletion README.md
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@

Drake ("dragon" in Middle English) is a C++ toolbox started by the Robot Locomotion Group at the MIT Computer Science and Artificial Intelligence Lab (CSAIL). The development team has now grown significantly, with core development led by the Toyota Research Institute. It is a collection of tools for analyzing the dynamics of our robots and building control systems for them, with a heavy emphasis on optimization-based design/analysis.

Please see the github wiki at http://drake.mit.edu for detailed documentation.
Please see the github wiki at https://drake.mit.edu for detailed documentation.

====

Expand Down
2 changes: 1 addition & 1 deletion automotive/README.md
Original file line number Diff line number Diff line change
Expand Up @@ -2,7 +2,7 @@ Demo Instructions
=================

These instructions only support the Bazel build system (not CMake). For
getting started with Bazel, see http://drake.mit.edu/bazel.html.
getting started with Bazel, see https://drake.mit.edu/bazel.html.

Running the demos
-----------------
Expand Down
2 changes: 1 addition & 1 deletion common/never_destroyed.h
Original file line number Diff line number Diff line change
Expand Up @@ -16,7 +16,7 @@ namespace drake {
/// trivially destructable. We shouldn't call their destructor at program exit
/// because of the "indeterminate order of ... destruction" as mentioned in
/// cppguide's
/// <a href="http://drake.mit.edu/styleguide/cppguide.html#Static_and_Global_Variables">Static
/// <a href="https://drake.mit.edu/styleguide/cppguide.html#Static_and_Global_Variables">Static
/// and Global Variables</a> section, but other solutions to this problem place
/// the objects on the heap through an indirection.
///
Expand Down
2 changes: 1 addition & 1 deletion doc/buildcop.rst
Original file line number Diff line number Diff line change
Expand Up @@ -98,7 +98,7 @@ author, and include the following template in the PR description.

[1] CI Continuous Production Dashboard: https://drake-jenkins.csail.mit.edu/view/Continuous%20Production/
[2] CI Nightly Production Dashboard: https://drake-jenkins.csail.mit.edu/view/Nightly%20Production/
[3] http://drake.mit.edu/buildcop.html#workflow-for-handling-a-build-cop-revert
[3] https://drake.mit.edu/buildcop.html#workflow-for-handling-a-build-cop-revert

.. _handling_a_build_cop_revert:

Expand Down
2 changes: 1 addition & 1 deletion doc/code_review_checklist.rst
Original file line number Diff line number Diff line change
Expand Up @@ -105,7 +105,7 @@ Did you use ``const`` where you could?

- Do all "plain old data" member fields have ``{}``?

- See `our style guide <http://drake.mit.edu/styleguide/cppguide.html#Variable_and_Array_Initialization>`_
- See `our style guide <https://drake.mit.edu/styleguide/cppguide.html#Variable_and_Array_Initialization>`_
citing "in-class member initialization."

Did you use a C-style cast by accident?
Expand Down
2 changes: 1 addition & 1 deletion doc/code_style_guide.rst
Original file line number Diff line number Diff line change
Expand Up @@ -28,7 +28,7 @@ C++ Style

The Drake C++ style guide (which is derived from the Google C++ style guide)
can be found
`on its own page <http://drake.mit.edu/styleguide/cppguide.html>`_.
`on its own page <https://drake.mit.edu/styleguide/cppguide.html>`_.
Its source lives in
`the styleguide repository <https://github.com/RobotLocomotion/styleguide>`_.

Expand Down
4 changes: 2 additions & 2 deletions doc/cxx_inl.rst
Original file line number Diff line number Diff line change
Expand Up @@ -74,7 +74,7 @@ The header file declares and documents the class::
/// @tparam T must be ... (document the requirements) ...
///
/// This class uses Drake's `-inl.h` pattern. When seeing linker errors from
/// this class, please refer to http://drake.mit.edu/cxx_inl.html.
/// this class, please refer to https://drake.mit.edu/cxx_inl.html.
///
/// Instantiated templates for the following kinds of T's are provided:
/// - double
Expand All @@ -96,7 +96,7 @@ The inl file defines the templated methods::
/// @file
/// Template method implementations for my_class.h.
/// Most users should only include that file, not this one.
/// For background, see http://drake.mit.edu/cxx_inl.html.
/// For background, see https://drake.mit.edu/cxx_inl.html.

#include "my_class.h"

Expand Down
4 changes: 2 additions & 2 deletions doc/documentation_instructions.rst
Original file line number Diff line number Diff line change
Expand Up @@ -10,9 +10,9 @@ otherwise the various build targets mentioned below will not exist.

This section contains instructions on how to generate Drake's documentation.
This includes both API documentation
(`C++ <http://drake.mit.edu/doxygen_cxx/index.html>`_),
(`C++ <https://drake.mit.edu/doxygen_cxx/index.html>`_),
which uses `Doxygen <http://www.stack.nl/~dimitri/doxygen/>`_, and
`Drake's website <http://drake.mit.edu>`_, which
`Drake's website <https://drake.mit.edu>`_, which
uses `Sphinx <http://www.sphinx-doc.org/en/stable/index.html>`_.

.. _documentation-generation-instructions-bazel:
Expand Down
6 changes: 3 additions & 3 deletions doc/doxygen.h
Original file line number Diff line number Diff line change
Expand Up @@ -28,7 +28,7 @@
</ul>
</ul>
<p>For more general information, you can also visit the <a
href="http://drake.mit.edu">Drake documentation main page</a>.</p>
href="https://drake.mit.edu">Drake documentation main page</a>.</p>
</p>
<p>Drake's C++ libraries use a small amount of template metaprogramming to
Expand All @@ -42,14 +42,14 @@
<p>
If you want to make your own Doxygen locally, see
<a href="http://drake.mit.edu/documentation_instructions.html">Documentation
<a href="https://drake.mit.edu/documentation_instructions.html">Documentation
Generation Instructions</a></p>
<p><a href="https://www.stack.nl/~dimitri/doxygen/manual/docblocks.html">Check
out the Doxygen C++ documentation</a></p>
<p>Drake's Doxygen documentation is
<a href="http://drake.mit.edu">hosted online</a> for the master branch, but is
<a href="https://drake.mit.edu">hosted online</a> for the master branch, but is
only updated nightly.</p>
<h3>Technical Notes</h3>
Expand Down
4 changes: 2 additions & 2 deletions doc/drakeURDF.xsd
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
<?xml version="1.0" encoding="UTF-8"?>

<xs:schema xmlns:xs="http://www.w3.org/2001/XMLSchema" targetNamespace="http://drake.mit.edu"
xmlns="http://drake.mit.edu" elementFormDefault="qualified">
<xs:schema xmlns:xs="http://www.w3.org/2001/XMLSchema" targetNamespace="https://drake.mit.edu"
xmlns="https://drake.mit.edu" elementFormDefault="qualified">

<xs:annotation>
<xs:documentation>XML Schema for DrakeURDF v1.0
Expand Down
46 changes: 23 additions & 23 deletions doc/index.rst
Original file line number Diff line number Diff line change
Expand Up @@ -17,30 +17,30 @@ While there are an increasing number of simulation tools available for robotics,

Here is a quick summary of capabilities:

* `Modeling Dynamical Systems <http://drake.mit.edu/doxygen_cxx/group__systems.html>`_
* C++ `block-diagram <http://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_diagram_builder.html#details>`_ modeling environment with support for:
* `Modeling Dynamical Systems <https://drake.mit.edu/doxygen_cxx/group__systems.html>`_
* C++ `block-diagram <https://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_diagram_builder.html#details>`_ modeling environment with support for:
* Continuous, discrete, hybrid, event-triggered, and multi-rate systems
* `Stochastic systems <http://drake.mit.edu/doxygen_cxx/stochastic_systems.html>`_
* `System constraints <http://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_system_constraint.html#details>`_
* `Rigid-body kinematics and dynamics <http://drake.mit.edu/doxygen_cxx/group__rigid__body__systems.html>`_
* Rigorously designed and tested, well-documented `multi-body library <http://drake.mit.edu/doxygen_cxx/group__multibody__concepts.html>`_
* `Stochastic systems <https://drake.mit.edu/doxygen_cxx/stochastic_systems.html>`_
* `System constraints <https://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_system_constraint.html#details>`_
* `Rigid-body kinematics and dynamics <https://drake.mit.edu/doxygen_cxx/group__rigid__body__systems.html>`_
* Rigorously designed and tested, well-documented `multi-body library <https://drake.mit.edu/doxygen_cxx/group__multibody__concepts.html>`_
* Load from :doc:`SDF / URDF models <models>` (+ a few custom tags)
* Contact/collisions modeled with either `compliant <http://drake.mit.edu/doxygen_cxx/group__drake__contacts.html>`_ or rigid contact using continuous (differential equation) and discrete (difference equation, i.e., time stepping) models; **Coming soon**: hybrid models for rigid contact
* Contact/collisions modeled with either `compliant <https://drake.mit.edu/doxygen_cxx/group__drake__contacts.html>`_ or rigid contact using continuous (differential equation) and discrete (difference equation, i.e., time stepping) models; **Coming soon**: hybrid models for rigid contact
* Geometry queries (e.g. collision detection, contact queries, and sensor queries) for simple geometries and convex meshes; **Coming soon**: non-convex meshes and multi-contact
* `Rich library of kinematic and dynamic queries <http://drake.mit.edu/doxygen_cxx/class_rigid_body_tree.html>`_ (e.g. Centroidal dynamics, Center of Pressure, Kinematic Jacobians, ...)
* `Sensor models <http://drake.mit.edu/doxygen_cxx/group__sensor__systems.html>`_ (lidar, RGB-D camera, imu, contact force/torque)
* `Rich library of kinematic and dynamic queries <https://drake.mit.edu/doxygen_cxx/class_rigid_body_tree.html>`_ (e.g. Centroidal dynamics, Center of Pressure, Kinematic Jacobians, ...)
* `Sensor models <https://drake.mit.edu/doxygen_cxx/group__sensor__systems.html>`_ (lidar, RGB-D camera, imu, contact force/torque)
* Hand-derived models for many canonical control dynamical systems
* `Easily add your own models/components <https://github.com/RobotLocomotion/drake/blob/master/examples/simple_continuous_time_system.cc>`_
* For nearly all of the above we aim to expose sparsity in the governing equations and provide analytical gradients / symbolic analysis
* **Coming soon**:
* API upgrade from `RigidBodyTree <http://drake.mit.edu/doxygen_cxx/class_rigid_body_tree.html>`_ to `MultiBodyTree <http://drake.mit.edu/doxygen_cxx/classdrake_1_1multibody_1_1_multibody_tree.html>`_
* API upgrade from `RigidBodyTree <https://drake.mit.edu/doxygen_cxx/class_rigid_body_tree.html>`_ to `MultiBodyTree <https://drake.mit.edu/doxygen_cxx/classdrake_1_1multibody_1_1_multibody_tree.html>`_
* Soft-body kinematics and dynamics
* More sophisticated rendering (towards photo-realism) and noise models for perception
* Core Libraries / Utilities
* `MathematicalProgram <http://drake.mit.edu/doxygen_cxx/group__solvers.html>`_, a C++ interface wrapping many open-source and commercial solvers
* `Symbolic Computation <http://drake.mit.edu/doxygen_cxx/namespacedrake_1_1symbolic.html>`_, Eigen-compatible scalar types for symbolic design and analysis
* `MathematicalProgram <https://drake.mit.edu/doxygen_cxx/group__solvers.html>`_, a C++ interface wrapping many open-source and commercial solvers
* `Symbolic Computation <https://drake.mit.edu/doxygen_cxx/namespacedrake_1_1symbolic.html>`_, Eigen-compatible scalar types for symbolic design and analysis
* Simulation and Analysis
* `Simulation <http://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_simulator.html>`_ with a suite of `numerical integration routines <http://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_integrator_base.html>`_
* `Simulation <https://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_simulator.html>`_ with a suite of `numerical integration routines <https://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_integrator_base.html>`_
* Local stability/controllability/observability analysis (via linearization / semi-definite programming)
* **To be ported from MATLAB to C++**:
* Find fixed points / trim conditions
Expand All @@ -49,9 +49,9 @@ Here is a quick summary of capabilities:
* **Coming soon**:
* Uncertainty quantification
* Planning
* Optimization-based inverse kinematics (fast `SQP-based methods <http://drake.mit.edu/doxygen_cxx/rigid__body__ik_8h.html>`_ and `Global IK <http://drake.mit.edu/doxygen_cxx/classdrake_1_1multibody_1_1_global_inverse_kinematics.html>`_)
* `Trajectory optimization <http://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_direct_trajectory_optimization.html>`_ (`kinematic <http://drake.mit.edu/doxygen_cxx/rigid__body__ik_8h.html#a6a69c1ef8426e4729ea1c7d4c11e6021>`_ and dynamic)
* `Rich library of constraints <http://drake.mit.edu/doxygen_cxx/class_rigid_body_constraint.html>`_ used by all of the above
* Optimization-based inverse kinematics (fast `SQP-based methods <https://drake.mit.edu/doxygen_cxx/rigid__body__ik_8h.html>`_ and `Global IK <https://drake.mit.edu/doxygen_cxx/classdrake_1_1multibody_1_1_global_inverse_kinematics.html>`_)
* `Trajectory optimization <https://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_direct_trajectory_optimization.html>`_ (`kinematic <https://drake.mit.edu/doxygen_cxx/rigid__body__ik_8h.html#a6a69c1ef8426e4729ea1c7d4c11e6021>`_ and dynamic)
* `Rich library of constraints <https://drake.mit.edu/doxygen_cxx/class_rigid_body_constraint.html>`_ used by all of the above
* **To be ported from MATLAB to C++**
* Contact-implicit trajectory optimization
* `Mixed-integer-convex trajectory optimization <https://github.com/RobotLocomotion/drake/issues/6243>`_
Expand All @@ -60,31 +60,31 @@ Here is a quick summary of capabilities:
* Feedback motion planning
* **Coming soon**:
* `Sample-based motion planning <https://github.com/RobotLocomotion/drake/issues/3413>`_
* `Feedback Control Design <http://drake.mit.edu/doxygen_cxx/group__control__systems.html>`_
* `Feedback Control Design <https://drake.mit.edu/doxygen_cxx/group__control__systems.html>`_
* LQR design for fixed-points
* `Inverse-dynamics controller with contact constraints <http://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_inverse_dynamics_controller.html#details>`_ using Quadratic Programming (e.g. for humanoid whole-body control)
* `Inverse-dynamics controller with contact constraints <https://drake.mit.edu/doxygen_cxx/classdrake_1_1systems_1_1_inverse_dynamics_controller.html#details>`_ using Quadratic Programming (e.g. for humanoid whole-body control)
* **To be ported from MATLAB to C++**
* Time-varying LQR
* Sums-of-squares-based feedback design
* Value iteration algorithms (for low dimensional systems)
* `State Estimation <http://drake.mit.edu/doxygen_cxx/group__estimator__systems.html>`_
* `State Estimation <https://drake.mit.edu/doxygen_cxx/group__estimator__systems.html>`_
* Recursive filter design (Kalman Filters, Luenberger observers)
* **Coming soon**:
* "Smoothing" estimators for nonlinear systems
* `System Identification <http://drake.mit.edu/doxygen_cxx/classdrake_1_1solvers_1_1_system_identification.html>`_
* `System Identification <https://drake.mit.edu/doxygen_cxx/classdrake_1_1solvers_1_1_system_identification.html>`_
* Least-squares "equation error" minimization for rigid body systems (with automatic extraction of identifiable lumped parameters)
* Nonlinear "simulation error" minimization
* `Many examples / benchmarks / model systems <https://github.com/RobotLocomotion/drake/tree/master/drake/examples>`_
* Acrobot, Cart-Pole, Bouncing balls, ...
* Quadrotors
* `Automotive/Traffic <http://drake.mit.edu/doxygen_cxx/group__automotive__systems.html>`_
* `Automotive/Traffic <https://drake.mit.edu/doxygen_cxx/group__automotive__systems.html>`_
* Manipulation
* **To be ported from MATLAB to C++**
* Fixed-Wing UAVs
* Walking Robots
* Humanoids (most notably including the bulk of our codebase for Atlas from `MIT's entry in the DARPA Robotics Challenge <http://drc.mit.edu>`_)
* Other
* `Message passing interfaces <http://drake.mit.edu/doxygen_cxx/group__message__passing.html>`_ (`LCM <https://github.com/lcm-proj/lcm>`_)
* `Message passing interfaces <https://drake.mit.edu/doxygen_cxx/group__message__passing.html>`_ (`LCM <https://github.com/lcm-proj/lcm>`_)

Most of these models/tools are described in `the companion textbook from an MIT course/MOOC <https://people.csail.mit.edu/russt/underactuated/underactuated.html?chapter=drake>`_. We've also recently started populating the :doc:`gallery` (contributions welcome!).

Expand All @@ -102,7 +102,7 @@ If you would like to cite Drake in your academic publications, we suggest the fo
author = "Russ Tedrake and the Drake Development Team",
title = "Drake: A planning, control, and analysis toolbox for nonlinear dynamical systems",
year = 2016,
url = "http://drake.mit.edu"
url = "https://drake.mit.edu"
}


Expand Down
8 changes: 4 additions & 4 deletions doc/models.rst
Original file line number Diff line number Diff line change
Expand Up @@ -22,7 +22,7 @@ Description Format), which are both XML formats.

* `SDF Reference <http://sdformat.org/>`_

* `Drake's version of URDF <http://drake.mit.edu/drake-urdf-schema-documentation/drakeURDF.html>`_. Drake's URDF has
* `Drake's version of URDF <https://drake.mit.edu/drake-urdf-schema-documentation/drakeURDF.html>`_. Drake's URDF has
extensions to the `official ROS URDF <http://wiki.ros.org/urdf/XML>`_.

The target audience for this document is for those who want to model a
Expand Down Expand Up @@ -74,7 +74,7 @@ digital representation of an object's surface. A texture may include color,
brightness, transparency, reflectivity, and other aspects. The texture is
mapped onto a preexisting surface - typically a mesh.

`URDF <http://drake.mit.edu/drake-urdf-schema-documentation/drakeURDF.html>`_- Unified Robot Description Format, an XML
`URDF <https://drake.mit.edu/drake-urdf-schema-documentation/drakeURDF.html>`_- Unified Robot Description Format, an XML
format for representing one model of a robot or other object. Unlike SDF,
only one object can be modeled per file, and pose cannot be modeled. Drake's
URDF extends the `official ROS URDF <http://wiki.ros.org/urdf/XML>`_.
Expand Down Expand Up @@ -167,7 +167,7 @@ existing, working model. `This tutorial <https://www.youtube
.com/watch?v=gugV8IMyHnY>`_ walks through editing a model in Drake.

For detailed information on the elements of a model, see the
`URDF <http://drake.mit.edu/drake-urdf-schema-documentation/drakeURDF.html>`_ or `SDF <http://sdformat.org/>`_
`URDF <https://drake.mit.edu/drake-urdf-schema-documentation/drakeURDF.html>`_ or `SDF <http://sdformat.org/>`_
references for more information.

.. _models_shape:
Expand Down Expand Up @@ -197,7 +197,7 @@ The ``<visual>`` tag is used in visualization programs like
`Director external <https://github.com/RobotLocomotion/director>`_). Drake does
not process the visual tag, unless you have something specific in your code that
will process it, like
`RgbdCamera <http://drake.mit.edu/doxygen_cxx/rgbd__camera_8h.html>`_.
`RgbdCamera <https://drake.mit.edu/doxygen_cxx/rgbd__camera_8h.html>`_.
Regardless of what program is processing the visual data, the processing time
of visual elements is generally not an issue.

Expand Down
2 changes: 1 addition & 1 deletion doc/python_bindings.rst
Original file line number Diff line number Diff line change
Expand Up @@ -231,6 +231,6 @@ For Developers
--------------

If you are developing Python bindings, please see the Doxygen page for
`Python Bindings <http://drake.mit.edu/doxygen_cxx/python_bindings.html>`_.
`Python Bindings <https://drake.mit.edu/doxygen_cxx/python_bindings.html>`_.
This provides information on programming conventions as well as tips for
debugging.
Loading

0 comments on commit a06b746

Please sign in to comment.