File tree Expand file tree Collapse file tree 11 files changed +59
-0
lines changed
nav2_mppi_controller/include/nav2_mppi_controller Expand file tree Collapse file tree 11 files changed +59
-0
lines changed Original file line number Diff line number Diff line change 1717
1818#include < memory>
1919#include < vector>
20+
21+ // xtensor creates warnings that needs to be ignored as we are building with -Werror
22+ #pragma GCC diagnostic push
23+ #pragma GCC diagnostic ignored "-Warray-bounds"
24+ #pragma GCC diagnostic ignored "-Wstringop-overflow"
2025#include < xtensor/xtensor.hpp>
26+ #pragma GCC diagnostic pop
2127
2228#include " geometry_msgs/msg/pose_stamped.hpp"
2329#include " nav2_core/goal_checker.hpp"
Original file line number Diff line number Diff line change 1919#include < string>
2020#include < vector>
2121#include < pluginlib/class_loader.hpp>
22+
23+ // xtensor creates warnings that needs to be ignored as we are building with -Werror
24+ #pragma GCC diagnostic push
25+ #pragma GCC diagnostic ignored "-Warray-bounds"
26+ #pragma GCC diagnostic ignored "-Wstringop-overflow"
2227#include < xtensor/xtensor.hpp>
28+ #pragma GCC diagnostic pop
2329
2430#include " geometry_msgs/msg/twist.hpp"
2531#include " geometry_msgs/msg/twist_stamped.hpp"
Original file line number Diff line number Diff line change 1515#ifndef NAV2_MPPI_CONTROLLER__MODELS__CONTROL_SEQUENCE_HPP_
1616#define NAV2_MPPI_CONTROLLER__MODELS__CONTROL_SEQUENCE_HPP_
1717
18+ // xtensor creates warnings that needs to be ignored as we are building with -Werror
19+ #pragma GCC diagnostic push
20+ #pragma GCC diagnostic ignored "-Warray-bounds"
21+ #pragma GCC diagnostic ignored "-Wstringop-overflow"
1822#include < xtensor/xtensor.hpp>
23+ #pragma GCC diagnostic pop
1924
2025namespace mppi ::models
2126{
Original file line number Diff line number Diff line change 1515#ifndef NAV2_MPPI_CONTROLLER__MODELS__PATH_HPP_
1616#define NAV2_MPPI_CONTROLLER__MODELS__PATH_HPP_
1717
18+ // xtensor creates warnings that needs to be ignored as we are building with -Werror
19+ #pragma GCC diagnostic push
20+ #pragma GCC diagnostic ignored "-Warray-bounds"
21+ #pragma GCC diagnostic ignored "-Wstringop-overflow"
1822#include < xtensor/xtensor.hpp>
23+ #pragma GCC diagnostic pop
1924
2025namespace mppi ::models
2126{
Original file line number Diff line number Diff line change 1515#ifndef NAV2_MPPI_CONTROLLER__MODELS__STATE_HPP_
1616#define NAV2_MPPI_CONTROLLER__MODELS__STATE_HPP_
1717
18+ // xtensor creates warnings that needs to be ignored as we are building with -Werror
19+ #pragma GCC diagnostic push
20+ #pragma GCC diagnostic ignored "-Warray-bounds"
21+ #pragma GCC diagnostic ignored "-Wstringop-overflow"
1822#include < xtensor/xtensor.hpp>
23+ #pragma GCC diagnostic pop
1924
2025#include < geometry_msgs/msg/pose_stamped.hpp>
2126#include < geometry_msgs/msg/twist.hpp>
Original file line number Diff line number Diff line change 1515#ifndef NAV2_MPPI_CONTROLLER__MODELS__TRAJECTORIES_HPP_
1616#define NAV2_MPPI_CONTROLLER__MODELS__TRAJECTORIES_HPP_
1717
18+ // xtensor creates warnings that needs to be ignored as we are building with -Werror
19+ #pragma GCC diagnostic push
20+ #pragma GCC diagnostic ignored "-Warray-bounds"
21+ #pragma GCC diagnostic ignored "-Wstringop-overflow"
1822#include < xtensor/xtensor.hpp>
1923#include < xtensor/xview.hpp>
24+ #pragma GCC diagnostic pop
2025
2126namespace mppi ::models
2227{
Original file line number Diff line number Diff line change 1919
2020#include " nav2_mppi_controller/models/control_sequence.hpp"
2121#include " nav2_mppi_controller/models/state.hpp"
22+
23+ // xtensor creates warnings that needs to be ignored as we are building with -Werror
24+ #pragma GCC diagnostic push
25+ #pragma GCC diagnostic ignored "-Warray-bounds"
26+ #pragma GCC diagnostic ignored "-Wstringop-overflow"
2227#include < xtensor/xmath.hpp>
2328#include < xtensor/xmasked_view.hpp>
2429#include < xtensor/xview.hpp>
2530#include < xtensor/xnoalias.hpp>
31+ #pragma GCC diagnostic pop
2632
2733#include " nav2_mppi_controller/tools/parameters_handler.hpp"
2834
Original file line number Diff line number Diff line change 1818#include < string>
1919#include < memory>
2020
21+ // xtensor creates warnings that needs to be ignored as we are building with -Werror
22+ #pragma GCC diagnostic push
23+ #pragma GCC diagnostic ignored "-Warray-bounds"
24+ #pragma GCC diagnostic ignored "-Wstringop-overflow"
2125#include < xtensor/xtensor.hpp>
2226#include < xtensor/xview.hpp>
27+ #pragma GCC diagnostic pop
2328
2429#include " rclcpp_lifecycle/lifecycle_node.hpp"
2530
Original file line number Diff line number Diff line change 2121#include < mutex>
2222#include < condition_variable>
2323
24+ // xtensor creates warnings that needs to be ignored as we are building with -Werror
25+ #pragma GCC diagnostic push
26+ #pragma GCC diagnostic ignored "-Warray-bounds"
27+ #pragma GCC diagnostic ignored "-Wstringop-overflow"
2428#include < xtensor/xtensor.hpp>
2529#include < xtensor/xview.hpp>
30+ #pragma GCC diagnostic pop
2631
2732#include " nav2_mppi_controller/models/optimizer_settings.hpp"
2833#include " nav2_mppi_controller/tools/parameters_handler.hpp"
Original file line number Diff line number Diff line change 1717
1818#include < memory>
1919#include < string>
20+
21+ // xtensor creates warnings that needs to be ignored as we are building with -Werror
22+ #pragma GCC diagnostic push
23+ #pragma GCC diagnostic ignored "-Warray-bounds"
24+ #pragma GCC diagnostic ignored "-Wstringop-overflow"
2025#include < xtensor/xtensor.hpp>
26+ #pragma GCC diagnostic pop
2127
2228#include " nav_msgs/msg/path.hpp"
2329#include " rclcpp/rclcpp.hpp"
You can’t perform that action at this time.
0 commit comments