Skip to content
Merged
Show file tree
Hide file tree
Changes from 51 commits
Commits
Show all changes
52 commits
Select commit Hold shift + click to select a range
6ecbe81
bump to 1.2.0 for iron release
SteveMacenski May 19, 2023
a1d489f
Iron sync June 9: 1.2.1 (#3615)
SteveMacenski Jun 9, 2023
2829e8e
remove non-virtual-dtor flag from nav2_package()
pepisg Jun 23, 2023
c8be6cf
WIP: Merge segmentation layer and GPS wpf
pepisg Jun 23, 2023
cb4d140
WIP: remove wrong whitespace
pepisg Jun 23, 2023
7ce7a6c
WIP: Bring back ffollow gps waypoints
pepisg Jun 23, 2023
a7f300c
WIP: error codes to gps waypoint follwer
pepisg Jun 23, 2023
bb046d4
Fix GPS waypoint follower error codes
pepisg Jun 23, 2023
2bb0502
Fixing build warning (#3667) (#3672)
mergify[bot] Jun 30, 2023
d79c210
Install nav2_behavior_tree utils outside of BUILD_TESTING (#3692) (#3…
mergify[bot] Jul 14, 2023
c12e34f
Fix segfault on relaunch of controller server
pepisg Jul 14, 2023
123e367
Fix the velocity smoother being stuck when the deadband is too high (…
mergify[bot] Jul 26, 2023
3a1d41e
Iron sync 2, Aug 4, 1.2.2 (#3740)
SteveMacenski Aug 4, 2023
12e196b
nav2_collision_monitor: collision detector (#3500) (Iron backport) (#…
Aug 31, 2023
faeb0d4
mppi: return NO_INFORMATION when the checked point is outside the cos…
mergify[bot] Sep 14, 2023
91290ef
Iron Sync 3 - Sept 25 (#3837)
SteveMacenski Sep 25, 2023
b7ff249
Update CMakeLists.txt (#3843) (#3844)
mergify[bot] Sep 27, 2023
10606c5
bump to 1.2.4 for AVX512 binary fix
SteveMacenski Sep 27, 2023
cb7340c
add option for sse4 and avs512 (#3853) (#3854)
mergify[bot] Oct 2, 2023
991c7f3
Bumping to 1.2.5 for binary release of AVX512 patches
SteveMacenski Oct 4, 2023
05cbb69
Start planner in the end of previous path
pepisg Oct 9, 2023
ce00cb1
[MPPI Optimization] adding regenerate noise param + adding docs (#386…
mergify[bot] Oct 11, 2023
446283c
[MPPI] Reworked Path Align Critic; 70% faster + Tracks Paths Better! …
mergify[bot] Oct 14, 2023
0fab8a6
merge iron
pepisg Oct 19, 2023
239e363
revert back to no gps waypoint follower
pepisg Oct 19, 2023
00a9066
Use mutex to protect costmap reads. (#3877) (#3896)
mergify[bot] Oct 23, 2023
5cae04e
Adjust the Variable types in Nav2_costmap_2d pkg in [nav2_humble] #3…
mergify[bot] Oct 24, 2023
629e27c
Log if BT rate is exceeded (#3909) (#3912)
mergify[bot] Oct 28, 2023
dc7b98e
Fixing subtree issues with blackboard shared resources (3640) (#3911)…
mergify[bot] Oct 30, 2023
f136e36
Update theta_star_planner.cpp (#3918) (#3921)
mergify[bot] Oct 30, 2023
3ade0b4
Change custom semantic segmentation message for image
pepisg Nov 2, 2023
741f585
Handle NaNs in AMCL beam sensor model (#3929) (#3936)
mergify[bot] Nov 3, 2023
18d069a
Fix NaN in Updated PathAlign (#3943) (#3944)
mergify[bot] Nov 6, 2023
b4ea1e0
Fix for robot footprint collision in obstacles critic (#3878) (#3946)
mergify[bot] Nov 6, 2023
c213c85
Enabling soft realtime prioritization to the Controller Server (#3914…
mergify[bot] Nov 20, 2023
a32fbd6
Integration of mapping api with dynamic velocities changes
Sunart24 Jan 3, 2024
a364280
simplify logic
Sunart24 Jan 9, 2024
b17be6d
eliminate un-necessary lines of code
Sunart24 Jan 10, 2024
e447d25
style
Sunart24 Jan 10, 2024
73f1068
style2
Sunart24 Jan 10, 2024
64b7e5a
Merge branch 'iron' of https://github.com/kiwicampus/navigation2 into…
pepisg Jan 22, 2024
cfac07d
Merge branch 'feature/dynamic_vel' of https://github.com/kiwicampus/n…
pepisg Jan 22, 2024
f79946f
remove duplicate line from merge
pepisg Jan 23, 2024
41428c1
Bring some custom changes into main
pepisg Feb 7, 2024
e5b1886
remove blank line
pepisg Feb 7, 2024
cff1bcd
restore nav2_utils copy_all_paramteres function.
Sunart24 Feb 12, 2024
1f6995d
Merge commit 'd509fbf0ee14c15a7692ac8fa852bf9d5821a3e2' into experime…
Sunart24 Mar 1, 2024
89c30a5
Add segmentation confidence plugin
pepisg Mar 14, 2024
8f4a7d7
Remove deprecated segmentation file
pepisg Mar 14, 2024
528219a
Merge branch 'experimental/merge-critic-cost' of https://github.com/k…
pepisg Apr 8, 2024
73f97b2
Docstrings and remove repeated struct
pepisg Apr 8, 2024
944cf47
Add docstrings & minor changes
pepisg Apr 16, 2024
File filter

Filter by extension

Filter by extension

Conversations
Failed to load comments.
Loading
Jump to
Jump to file
Failed to load files.
Loading
Diff view
Diff view
Original file line number Diff line number Diff line change
Expand Up @@ -135,7 +135,7 @@ bool BtActionServer<ActionT>::on_configure()
node, "robot_base_frame", rclcpp::ParameterValue(std::string("base_link")));
nav2_util::declare_parameter_if_not_declared(
node, "transform_tolerance", rclcpp::ParameterValue(0.1));
rclcpp::copy_all_parameter_values(node, client_node_);
nav2_util::copy_all_parameters(node, client_node_);

// set the timeout in seconds for the action server to discard goal handles if not finished
double action_server_result_timeout;
Expand Down
4 changes: 4 additions & 0 deletions nav2_costmap_2d/CMakeLists.txt
Original file line number Diff line number Diff line change
Expand Up @@ -17,6 +17,7 @@ find_package(rclcpp_lifecycle REQUIRED)
find_package(rmw REQUIRED)
find_package(sensor_msgs REQUIRED)
find_package(std_msgs REQUIRED)
find_package(vision_msgs REQUIRED)
find_package(std_srvs REQUIRED)
find_package(tf2_geometry_msgs REQUIRED)
find_package(tf2 REQUIRED)
Expand All @@ -40,6 +41,7 @@ add_library(nav2_costmap_2d_core SHARED
src/footprint.cpp
src/costmap_layer.cpp
src/observation_buffer.cpp
src/segmentation_buffer.cpp
src/clear_costmap_service.cpp
src/footprint_collision_checker.cpp
plugins/costmap_filters/costmap_filter.cpp
Expand All @@ -66,6 +68,7 @@ set(dependencies
rclcpp_lifecycle
sensor_msgs
std_msgs
vision_msgs
std_srvs
tf2
tf2_geometry_msgs
Expand All @@ -88,6 +91,7 @@ add_library(layers SHARED
plugins/voxel_layer.cpp
plugins/range_sensor_layer.cpp
plugins/denoise_layer.cpp
plugins/semantic_segmentation_layer.cpp
)
add_library(${PROJECT_NAME}::layers ALIAS layers)
ament_target_dependencies(layers
Expand Down
3 changes: 3 additions & 0 deletions nav2_costmap_2d/costmap_plugins.xml
Original file line number Diff line number Diff line change
Expand Up @@ -18,6 +18,9 @@
<class type="nav2_costmap_2d::DenoiseLayer" base_class_type="nav2_costmap_2d::Layer">
<description>Filters noise-induced freestanding obstacles or small obstacles groups</description>
</class>
<class type="nav2_costmap_2d::SemanticSegmentationLayer" base_class_type="nav2_costmap_2d::Layer">
<description>A plugin for semantic segmentation data produced by RGBD cameras</description>
</class>
</library>

<library path="filters">
Expand Down
19 changes: 19 additions & 0 deletions nav2_costmap_2d/include/nav2_costmap_2d/observation_buffer.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -62,6 +62,7 @@ class ObservationBuffer
/**
* @brief Constructs an observation buffer
* @param topic_name The topic of the observations, used as an identifier for error and warning messages
* @param source_name The name of the source as declared in the parameters, used to change source specific params
* @param observation_keep_time Defines the persistence of observations in seconds, 0 means only keep the latest
* @param expected_update_rate How often this buffer is expected to be updated, 0 means there is no limit
* @param min_obstacle_height The minimum height of a hitpoint to be considered legal
Expand All @@ -78,6 +79,7 @@ class ObservationBuffer
ObservationBuffer(
const nav2_util::LifecycleNode::WeakPtr & parent,
std::string topic_name,
std::string source_name,
double observation_keep_time,
double expected_update_rate,
double min_obstacle_height, double max_obstacle_height, double obstacle_max_range,
Expand Down Expand Up @@ -132,6 +134,22 @@ class ObservationBuffer
*/
void resetLastUpdated();

/**
* @brief Set max obstacle distance
*/
void setMaxObstacleDistance(double max_obstacle_distance)
{
obstacle_max_range_ = max_obstacle_distance;
}

/**
* @brief Get source name
*/
std::string getSourceName()
{
return source_name_;
}

private:
/**
* @brief Removes any stale observations from the buffer list
Expand All @@ -148,6 +166,7 @@ class ObservationBuffer
std::string sensor_frame_;
std::list<Observation> observation_list_;
std::string topic_name_;
std::string source_name_;
double min_obstacle_height_, max_obstacle_height_;
std::recursive_mutex lock_; ///< @brief A lock for accessing data in callbacks safely
double obstacle_max_range_, obstacle_min_range_, raytrace_max_range_, raytrace_min_range_;
Expand Down
1 change: 1 addition & 0 deletions nav2_costmap_2d/include/nav2_costmap_2d/obstacle_layer.hpp
Original file line number Diff line number Diff line change
Expand Up @@ -253,6 +253,7 @@ class ObstacleLayer : public CostmapLayer
bool rolling_window_;
bool was_reset_;
nav2_costmap_2d::CombinationMethod combination_method_;
std::string _topics_string;
};

} // namespace nav2_costmap_2d
Expand Down
Loading