Skip to content

Tags: robotechvision/navigation2

Tags

0.4.4

Toggle 0.4.4's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
Foxy sync 4 - SMAC planner, amongst others (ros-navigation#2072)

* initialize variables in inflation layer (ros-navigation#1970)

* Fix zero waypoints crash (ros-navigation#1978)

* return if the number of waypoints is zero.

* terminate the action.

* Succeed action instead of terminating.

* Add IsBatteryLow condition node (ros-navigation#1974)

* Add IsBatteryLow condition node

* Update default battery topic and switch to battery %

* Fix test

* Switch to sensor_msgs/BatteryState

* Add option to use voltage by default or switch to percentage

* Add sensor_msgs dependency in package.xml

* Make percentage default over voltage

* Update parameter list

* Initialize inflate_cone_ variable. (ros-navigation#1988)

* Initialize inflate_cone_ variable.

* initialize inflate_cone_ based on parameter.

* Increase the sleep time in the tests makes the costmap test always succeed on my machine.

* Add timeouts to all spin_until_future_complete calls (ros-navigation#1998)

* Add timeouts to all spin_until_future_complete calls

Signed-off-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* Update default timeout value

Signed-off-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* Controllers should not be influenced by time jumps or slew (ros-navigation#2012)

* Controllers should not be influenced by time jumps

Therefore use rclcpp::GenericRate<std::chrono::steady_clock> instead of
rclcpp::Rate

Signed-off-by: Martijn Buijs <martijn.buijs@gmail.com>

* Change to using `rclcpp::WallRate` for better readability

Signed-off-by: Martijn Buijs <martijn.buijs@gmail.com>

* Fix max path cycles for case where map has larger Y dimension than X dimension (ros-navigation#2017)

* Fix max path cycles for case where map has larger Y dimension than X dimension

* Improve readability

* fix ament_cpplint and ament_uncrustify issues

* fix minor cherry pick conflict mistake

* bump version to 0.4.4

Co-authored-by: Michael Ferguson <mfergs7@gmail.com>
Co-authored-by: Wilco Bonestroo <w.j.bonestroo@saxion.nl>
Co-authored-by: Sarthak Mittal <sarthakmittal2608@gmail.com>
Co-authored-by: Martijn Buijs <Martijn.buijs@gmail.com>
Co-authored-by: justinIRBT <69175069+justinIRBT@users.noreply.github.com>

0.4.3

Toggle 0.4.3's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
Foxy sync 3 (ros-navigation#1965)

* waypoint_follower node has _rclcpp_node as well as base node (ros-navigation#1940)

* Add #include <vector> for vector<> (ros-navigation#1946)

To fix cpplint

* Add 'angles' dependency to nav2_costmap_2d package.xml (ros-navigation#1947)

* transform goal to costmap frame (ros-navigation#1949)

The plan recieved is usually in global frame, but
our local costmap is often in odom frame. This
fixes a regression from ros-navigation#1857

* Add mutex lock into inflation layer to avoid thread issue in updating footprint (ros-navigation#1952)

Signed-off-by: Daisuke Sato <daisukes@cmu.edu>

* Fix being unable to change StandardTrajectoryGenerator parameter vtheta_samples (ros-navigation#1619)

* Fix tests declaring parameters real nodes don't

Signed-off-by: Shane Loretz <sloretz@osrfoundation.org>

* Fix loadParameterWithDeprecation not getting initial parameter values

Signed-off-by: Shane Loretz <sloretz@osrfoundation.org>

* Create sim_time variable before using it

Signed-off-by: Shane Loretz <sloretz@osrfoundation.org>

* Line length < 100

Signed-off-by: Shane Loretz <sloretz@osrfoundation.org>

* Add missing {

Signed-off-by: Shane Loretz <sloretz@osrfoundation.org>

* Linter fixes

Signed-off-by: Shane Loretz <sloretz@openrobotics.org>

* sim_granularity -> time_granularity

Signed-off-by: Shane Loretz <sloretz@openrobotics.org>

* Linter fix

Signed-off-by: Shane Loretz <sloretz@openrobotics.org>

* update version to 0.4.3

* removing redundant dep on angles

Co-authored-by: Ruffin <roxfoxpox@gmail.com>
Co-authored-by: Sarthak Mittal <sarthakmittal2608@gmail.com>
Co-authored-by: Michael Ferguson <mfergs7@gmail.com>
Co-authored-by: Daisuke Sato <43101027+daisukes@users.noreply.github.com>
Co-authored-by: Shane Loretz <sloretz@openrobotics.org>

0.4.2

Toggle 0.4.2's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
Foxy sync 2 (July 1 to August 7) (ros-navigation#1932)

* Add slam toolbox as exec dep for nav2_bringup (ros-navigation#1827)

* Add slam toolbox as exec dep

* Added slam toolbox

* Changed version of slam toolbox to foxy-devel

* Added modifications to allow for exec depend of slam toolbox without breaking docker / CI

* reformatted skip keys

* Added tabs to skip key arguments

* Removed commented out code block

* Add unit tests for follow path, compute path to pose, and navigate to pose BT action nodes (ros-navigation#1844)

* Add compute path to pose unit tests

Signed-off-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* Add follow path action unit tests

Signed-off-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* Add navigate to pose action unit tests

Signed-off-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* adding foxy build icons to readme (ros-navigation#1853)

* adding foxy build icons

* adding dividers

* sync master from foxy version updates (ros-navigation#1852)

* sync master from foxy version updates

* syncing foxy and master

* Add unit tests for clear entire costmap and reinitialize global localization BT service nodes (ros-navigation#1845)

* Add clear entire costmap service unit tests

Signed-off-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* Add reinitialize global localization service unit test

Signed-off-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* Temporarily disable dump_params test (ros-navigation#1856)

Signed-off-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* commenting out unused validPointPotential (ros-navigation#1854)

* Adding ROS2 versions to issue template (ros-navigation#1861)

* reload behavior tree before creating RosTopicLogger to prevent nullptr error or no /behavior_tree_log problem (ros-navigation#1849)

Signed-off-by: Daisuke Sato <daisukes@cmu.edu>

* Add citation for IROS paper (ros-navigation#1867)

* Add citation

We'll want to add the DOI once published

* Bump citation section above build status

* Fix line breaks

* Changes RCUTILS_CONSOLE_STDOUT_LINE_BUFFERED to RCUTILS_LOGGING_BUFFERED_STREAM (ros-navigation#1868)

* Added parameters to configure amcl laser scan topic (ros-navigation#1870)

* Added parameters to configure amcl topic

* changed parameter to scan_topic and added to all the configuration files

* added scan_topic amcl param to docs

* Satisfied linter

* Move dwb goal/progress checker plugins to nav2_controller (ros-navigation#1857)

* Move dwb goal/progress checker plugins to nav2_controller

Signed-off-by: Siddarth Gore <siddarth.gore@gmail.com>

* Move goal/progress checker plugins to nav2_controller

Address review comments

Signed-off-by: Siddarth Gore <siddarth.gore@gmail.com>

* Move goal/progress checker plugins to nav2_controller

Use new plugin declaration format and doc update

Signed-off-by: Siddarth Gore <siddarth.gore@gmail.com>

* Update bringup.yaml for new plugins in nav2_controller

Also remove redundent file from dwb_plugins
Signed-off-by: Siddarth Gore <siddarth.gore@gmail.com>

* Fix doc errors and update remaining yaml files

Signed-off-by: Siddarth Gore <siddarth.gore@gmail.com>

* Remove mention of goal_checker from dwb docs

Signed-off-by: Siddarth Gore <siddarth.gore@gmail.com>

* Add .plugin params to doc

Signed-off-by: Siddarth Gore <siddarth.gore@gmail.com>

* Tests for progress_checker plugin

declare .plugin only if not declared before

Signed-off-by: Siddarth Gore <siddarth.gore@gmail.com>

* Tweak plugin names/description in doc

Signed-off-by: Siddarth Gore <siddarth.gore@gmail.com>

* Follow pose (ros-navigation#1859)

* Truncate path finished

Signed-off-by: Francisco Martin Rico <fmrico@gmail.com>

* Follow Pose finished

Signed-off-by: Francisco Martin Rico <fmrico@gmail.com>

* Change names. Add test and doc

Signed-off-by: Francisco Martin Rico <fmrico@gmail.com>

* Change names and check atan2 values

Signed-off-by: Francisco Martin Rico <fmrico@gmail.com>

* Checking Inf/NaNs and trucate path changes

Signed-off-by: Francisco Martin Rico <fmrico@gmail.com>

* Revert changes in launcher

Signed-off-by: Francisco Martin Rico <fmrico@gmail.com>

* Documenting Tree

Signed-off-by: Francisco Martin Rico <fmrico@gmail.com>

* Update nav2_bt_navigator/README.md

Co-authored-by: Steve Macenski <stevenmacenski@gmail.com>

* Update nav2_bt_navigator/README.md

Co-authored-by: Steve Macenski <stevenmacenski@gmail.com>

* Change TruncatePath from decorator to action node

Signed-off-by: Francisco Martin Rico <fmrico@gmail.com>

* Update nav2_bt_navigator/README.md

Co-authored-by: Steve Macenski <stevenmacenski@gmail.com>

Co-authored-by: Steve Macenski <stevenmacenski@gmail.com>

* Remove Deprecated Declaration (ros-navigation#1884)

* Remove deprecated rclcpp::executor::FutureReturnCode::SUCCESS in favor of rclcpp::FutureReturnCode::SUCCESS

Signed-off-by: Hunter L. Allen <hunter.allen@ghostrobotics.io>

* Update nav2_util/include/nav2_util/service_client.hpp

Co-authored-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

Co-authored-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* Added new costmap buffer to resize map safely (ros-navigation#1837)

* Added new costmap buffer to resize map safely

Signed-off-by: Aitor Miguel Blanco <aitormibl@gmail.com>

* Update map if the layer is not being processed.

Signed-off-by: Aitor Miguel Blanco <aitormibl@gmail.com>

* Updated bool name and added buffer initialization

Signed-off-by: Aitor Miguel Blanco <aitormibl@gmail.com>

* Fix dump params tests (ros-navigation#1886)

Signed-off-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* Move definitions in tf_help to separate src cpp file (ros-navigation#1890)

* Move definitions of functions in tf_help to separate src cpp file to avoid multiple definition error

* Fix linting issues

* Make uncrustify happier

* More format fixing

* resolved the simulated motion into its x & y components (ros-navigation#1887)

Signed-off-by: Marwan Taher <marokhaled99@gmail.com>

* Fix nav2_bt_navigator cleanup (ros-navigation#1901)

Signed-off-by: Sarthak Mittal <sarthakmittal2608@gmail.com>

* Adding some more test coverage (ros-navigation#1903)

* more tests

* removing old cmake

* remove on_errors in specific servers in favor of a general lifecycle warning (ros-navigation#1904)

* remove on_errors in favor of a general lifecycle warning

* adding removed thing

* simply nodes to remove lines (ros-navigation#1907)

* Bunches of random new tests (ros-navigation#1909)

* trying to get A* to work again

* make flake 8 happy

* adding cancel and preempt test

* planner tests use A*

* adding A* note

* test with topic

* Adding failure to navigate test (ros-navigation#1912)

* failures tests

* adding copyrights

* cancel test in recoveries

* Costmap lock while copying data in navfn planner (ros-navigation#1913)

* acquire the costmap lock while copying data in navfn planner

Signed-off-by: Daisuke Sato <daisukes@cmu.edu>

* add costmap lock to dwb local plannger

Signed-off-by: Daisuke Sato <daisukes@cmu.edu>

* Added map_topic parameters to static layer and amcl (ros-navigation#1910)

* see if spin some in cancel will allow result callback (ros-navigation#1914)

* Adding near-complete voxel grid test coverage and more to controller server (ros-navigation#1915)

* remove erraneous handling done by prior

* adding a bunch of voxel unit tests

* retrigger

* adding waypoint follower failure test, voxel layer integration tests, etc (ros-navigation#1916)

* adding waypoint follower failure test

* adding voxel, more logging

* reset -> clear

* minor changes to lower redundent warnings (ros-navigation#1918)

* Costmap plugins declare if not declared for reset capabilities (ros-navigation#1919)

* fixing ros-navigation#1917 on declare if not declared

* fix API

* adding CLI test (ros-navigation#1920)

* More coverage in map server tests (ros-navigation#1921)

* adding CLI test

* adding a bunch of new coverages for map_server

* Add in range sensor costmap layer (ros-navigation#1888)

* range costmap building

* range sensor layer working

* nav2 costmap pass linter and uncrustify tests

* Added back semicolon to range class

* Added docs

* Added angles dependency

* Added BSD license

* Added BSD license

* Made functions inline

* revmoed get_clock

* added input_sensor_type to docs

* Made defualt topic name empty to cause error

* using chorno literal to denote time units

* Added small initial test

* Fixed linter error, line breaks, enum, logger level, and transform_tolerance issue

* fixed segmentation fault in test and added transfrom tolerances to tf_->transform

* Got test to pass

* Added more tests

* removed incorrect parameter declaration

* Improved marking while moving tests and added clearing tests

* removed general clearing test

* changed testing helper import in test

* [Test sprint] push nav2_map_server over 90% (ros-navigation#1922)

* adding CLI test

* adding tests for more lines to map_server

* fix last test

* adding out of bounds and higher bounds checks

* adding planner tests for plugins working

* add cleanup

* working

* ping

* [testing sprint] final test coverage and debug logging in planner/controller servers (ros-navigation#1924)

* adding CLI test

* adding tests for more lines to map_server

* fix last test

* adding out of bounds and higher bounds checks

* adding planner tests for plugins working

* add cleanup

* working

* ping

* adding more testing and debug info messages

* [testing sprint] remove dead code not used in 10 years from navfn (ros-navigation#1926)

* remove dead code not used in 10 years from navfn

* ping

* inverting period to rate

* removing debug statement that could never be triggered by a single non-looping action server

* type change

* adding removed files

* bump to 0.4.2

* add another missing file

* add missing files

* remove some tests

* lint

* removing nav2_bringup from binaries

Co-authored-by: Michael Equi <32988490+Michael-Equi@users.noreply.github.com>
Co-authored-by: Sarthak Mittal <sarthakmittal2608@gmail.com>
Co-authored-by: Daisuke Sato <43101027+daisukes@users.noreply.github.com>
Co-authored-by: Ruffin <roxfoxpox@gmail.com>
Co-authored-by: Siddarth Gore <siddarth.gore@gmail.com>
Co-authored-by: Francisco Martín Rico <fmrico@gmail.com>
Co-authored-by: Hunter L. Allen <hunter.allen@ghostrobotics.io>
Co-authored-by: Aitor Miguel Blanco <aitormibl@gmail.com>
Co-authored-by: Joe Smallman <ijsmallman@gmail.com>
Co-authored-by: Marwan Taher <marokhaled99@gmail.com>

0.4.1

Toggle 0.4.1's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
Adding missing deps to nav2_util (ros-navigation#1851)

* adding launch to nav2_util

* bump to 0.4.1

* adding test dep

* try explicit

0.4.0

Toggle 0.4.0's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
bump to 0.4.0 (ros-navigation#1840)

0.3.5

Toggle 0.3.5's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
bump to 0.3.5 (ros-navigation#1833)

0.3.4

Toggle 0.3.4's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
Eloquent sync (ros-navigation#1577)

* added a red circle for target pose location. changed the way marker id numbers are generated. resized markers

* edited a comment line

* cherry-picking mjeronimo:fix_bt_crash_after_reset (ros-navigation#1515)

* syncing eloquent with 1940266

* bump to 0.3.4

Co-authored-by: Melih Erdogan <h.meliherdogan@gmail.com>
Co-authored-by: John Connolly <johnconn@umich.edu>

0.3.3

Toggle 0.3.3's commit message

Verified

This commit was created on GitHub.com and signed with GitHub’s verified signature. The key has expired.
adding bringup to system tests package.xml (ros-navigation#1507)

* adding bringup to system tests package.xml

* bump 0.3.2 - 0.3.3

0.3.2

Toggle 0.3.2's commit message
bump to 0.3.2

0.3.1

Toggle 0.3.1's commit message
bumping 0.2.4 to 0.3.1