Skip to content

Commit

Permalink
New branch init
Browse files Browse the repository at this point in the history
  • Loading branch information
guillermogilg99 committed Jun 7, 2024
1 parent d06159d commit 970e452
Show file tree
Hide file tree
Showing 153 changed files with 471 additions and 49 deletions.
Empty file modified .github/workflows/build_noetic.yml
100644 → 100755
Empty file.
Empty file modified .gitignore
100644 → 100755
Empty file.
21 changes: 16 additions & 5 deletions CMakeLists.txt
100644 → 100755
Original file line number Diff line number Diff line change
@@ -1,7 +1,7 @@
cmake_minimum_required(VERSION 3.10.2)
project(heuristic_planners)

add_compile_options(-std=c++17 -Wall -Werror -Wextra -pedantic )
add_compile_options(-std=gnu++17 -Wall )

option(BUILD_DOC "Build documentation " ON)
option(BUILD_ROS_SUPPORT "Build with ROS Support" ON)
Expand All @@ -27,6 +27,7 @@ if(BUILD_DOC)
# set input and output files
set(DOXYGEN_IN ${CMAKE_CURRENT_SOURCE_DIR}/Doxyfile)
set(DOXYGEN_OUT ${CMAKE_CURRENT_BINARY_DIR}/Doxyfile)


# request to configure the file
configure_file(${DOXYGEN_IN} ${DOXYGEN_OUT} @ONLY)
Expand Down Expand Up @@ -55,15 +56,21 @@ if(BUILD_ROS_SUPPORT)
nav_msgs
visualization_msgs
message_generation
rospy
roscpp
pcl_conversions
pcl_ros
octomap_ros
costmap_2d
sensor_msgs
)
#Eigen is used to calculate metrics parameters
find_package (Eigen3 REQUIRED NO_MODULE)
find_package(OpenSSL REQUIRED)
####### TORCH DIR SHOULD BE SET TO LIBTORCH FOLDER ########
set(Torch_DIR "/home/ros/libtorch/share/cmake/Torch")
find_package(Torch REQUIRED)
set(CMAKE_CXX_FLAGS "${CMAKE_CXX_FLAGS} ${TORCH_CXX_FLAGS}")
if(BUILD_DEBUG)
add_definitions(-DPUB_EXPLORED_NODES)
endif()
Expand All @@ -79,6 +86,7 @@ add_service_files(
FILES
GetPath.srv
SetAlgorithm.srv
ShareWeights.srv
)

## Generate added messages and services with any dependencies listed here
Expand All @@ -101,7 +109,7 @@ catkin_package(
INCLUDE_DIRS include
LIBRARIES AlgorithmBase AStar AStarM1 AStarM2 ThetaStar ThetaStarM1 ThetaStarM2 LazyThetaStar LazyThetaStarM1 LazyThetaStarM1Mod LazyThetaStarM2
#
CATKIN_DEPENDS std_msgs visualization_msgs geometry_msgs nav_msgs roscpp message_runtime costmap_2d
CATKIN_DEPENDS std_msgs visualization_msgs geometry_msgs nav_msgs rospy roscpp message_runtime costmap_2d sensor_msgs pcl_ros pcl_conversions
# DEPENDS system_lib
)
endif()
Expand All @@ -112,6 +120,7 @@ endif()
include_directories(
include
${catkin_INCLUDE_DIRS}
${TORCH_INCLUDE_DIRS}
${CMAKE_CURRENT_SOURCE_DIR}/include/voro++-0.4.6
)
if( BUILD_VOROCPP )
Expand Down Expand Up @@ -139,7 +148,8 @@ list(APPEND ${PROJECT_NAME}_UTILS_SOURCES src/utils/geometry_utils.cpp
src/utils/heuristic.cpp
src/utils/LineOfSight.cpp
src/utils/utils.cpp
src/utils/metrics.cpp
src/utils/metrics.cpp
src/utils/FCNet.cpp
)
if(BUILD_ROS_SUPPORT)
list(APPEND ${PROJECT_NAME}_UTILS_SOURCES src/utils/ros/ROSInterfaces.cpp)
Expand All @@ -166,14 +176,15 @@ add_library(LazyThetaStarM2 src/Planners/LazyThetaStarM2.cpp )


list(APPEND ${PROJECT_NAME}_LIBRARIES AlgorithmBase AStar AStarM1 AStarM2 ThetaStar ThetaStarM1 ThetaStarM2 LazyThetaStar LazyThetaStarM1 LazyThetaStarM1Mod LazyThetaStarM2)
target_link_libraries(${${PROJECT_NAME}_LIBRARIES} ${catkin_LIBRARIES} ${Boost_LIBRARIES})
target_link_libraries(${${PROJECT_NAME}_LIBRARIES} ${catkin_LIBRARIES} ${Boost_LIBRARIES} ${TORCH_LIBRARIES})
add_dependencies( ${${PROJECT_NAME}_LIBRARIES} ${${PROJECT_NAME}_EXPORTED_TARGETS} ${catkin_EXPORTED_TARGETS})
list(APPEND ${PROJECT_NAME}_TARGETS ${${PROJECT_NAME}_LIBRARIES})

if(BUILD_ROS_SUPPORT)
add_executable(planner_ros_node src/ROS/planner_ros_node.cpp )
##set_property(TARGET planner_ros_node PROPERTY CXX_STANDARD 17)
add_dependencies(planner_ros_node ${${PROJECT_NAME}_EXPORTED_TARGETS} ${catkin_EXPORTED_TARGETS} ${${PROJECT_NAME}_LIBRARIES})
target_link_libraries(planner_ros_node ${catkin_LIBRARIES} ${${PROJECT_NAME}_LIBRARIES} -lstdc++fs Eigen3::Eigen -lcrypto -lssl)
target_link_libraries(planner_ros_node ${catkin_LIBRARIES} ${TORCH_LIBRARIES} ${${PROJECT_NAME}_LIBRARIES} -lstdc++fs Eigen3::Eigen -lcrypto -lssl)
list(APPEND ${PROJECT_NAME}_TARGETS planner_ros_node)
#############
## Install ##
Expand Down
Empty file modified Doxyfile
100644 → 100755
Empty file.
Empty file modified LICENSE
100644 → 100755
Empty file.
Empty file modified README.md
100644 → 100755
Empty file.
Empty file modified config/costmap_for_rand_maps.yaml
100644 → 100755
Empty file.
Empty file modified config/example_costmap_params.yaml
100644 → 100755
Empty file.
Empty file modified docs/1.Status.md
100644 → 100755
Empty file.
Empty file modified docs/2.ROSNodeInterface.md
100644 → 100755
Empty file.
Empty file modified docs/algorithms_class_hr.png
100644 → 100755
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Empty file modified include/Grid3D/grid3d.hpp
100644 → 100755
Empty file.
7 changes: 4 additions & 3 deletions include/Planners/AStar.hpp
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -30,6 +30,7 @@
#include <pcl/point_types.h>
#include <pcl_ros/point_cloud.h>
#include "utils/ros/ROSInterfaces.hpp"
#include "utils/FCNet.hpp"
#endif

namespace Planners{
Expand Down Expand Up @@ -70,7 +71,7 @@ namespace Planners{
* DataVariant = std::variant<std::string, Vec3i, CoordinateList, double, size_t, int, bool, unsigned int>;
* TODO: Replace map here by unordered_map. Not much important, but it does not make sense to use a map.
*/
PathData findPath(const Vec3i &_source, const Vec3i &_target) override;
PathData findPath(const Vec3i &_source, const Vec3i &_target, HIOSDFNet& sdf_net) override;

/**
* @brief Published occupation markers map to visualize the loaded map in RVIZ
Expand Down Expand Up @@ -125,7 +126,7 @@ namespace Planners{
* This operation of erase and re-insert is performed in order to update the position
* of the node in the container.
*/
virtual void exploreNeighbours(Node* _current, const Vec3i &_target,node_by_position &_index_by_pos);
virtual void exploreNeighbours(Node* _current, const Vec3i &_target,node_by_position &_index_by_pos, HIOSDFNet& sdf_net);

/**
* @brief This functions implements the algorithm G function.
Expand Down Expand Up @@ -161,7 +162,7 @@ namespace Planners{
* @param _dirs Number of directions used (to distinguish between 2D and 3D)
* @return unsigned int The G Value calculated by the function
*/
virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs);
virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs, HIOSDFNet& sdf_net);

unsigned int line_of_sight_checks_{0}; /*!< TODO Comment */
std::vector<Node*> closedSet_; /*!< TODO Comment */
Expand Down
2 changes: 1 addition & 1 deletion include/Planners/AStarM1.hpp
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -58,7 +58,7 @@ namespace Planners{
* @param _dirs Number of directions used (to distinguish between 2D and 3D)
* @return unsigned int The G Value calculated by the function
*/
inline virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs) override;
inline virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs, HIOSDFNet& sdf_net) override;

};

Expand Down
2 changes: 1 addition & 1 deletion include/Planners/AStarM2.hpp
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -56,7 +56,7 @@ namespace Planners{
* @param _dirs Number of directions used (to distinguish between 2D and 3D)
* @return unsigned int The G Value calculated by the function
*/
inline virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs) override;
inline virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs, HIOSDFNet& sdf_net) override;

};

Expand Down
3 changes: 2 additions & 1 deletion include/Planners/AlgorithmBase.hpp
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -28,6 +28,7 @@
#include "utils/time.hpp"
#include "utils/geometry_utils.hpp"
#include "utils/LineOfSight.hpp"
#include "utils/FCNet.hpp"

namespace Planners
{
Expand Down Expand Up @@ -154,7 +155,7 @@ namespace Planners
* @param _target Goal discrete coordinates
* @return PathData Results stored as PathData object
*/
virtual PathData findPath(const Vec3i &_source, const Vec3i &_target) = 0;
virtual PathData findPath(const Vec3i &_source, const Vec3i &_target, HIOSDFNet& sdf_net) = 0;

/**
* @brief Configure the simple inflation implementation
Expand Down
2 changes: 1 addition & 1 deletion include/Planners/LazyThetaStar.hpp
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -53,7 +53,7 @@ namespace Planners
* @param _target Goal discrete coordinates
* @return PathData PathData Results stored as PathData object
*/
virtual PathData findPath(const Vec3i &_source, const Vec3i &_target) override;
virtual PathData findPath(const Vec3i &_source, const Vec3i &_target, HIOSDFNet& sdf_net) override;

protected:

Expand Down
2 changes: 1 addition & 1 deletion include/Planners/LazyThetaStarM1.hpp
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -69,7 +69,7 @@ namespace Planners
* @param _dirs Number of directions used (to distinguish between 2D and 3D)
* @return unsigned int The G Value calculated by the function
*/
virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs) override;
virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs, HIOSDFNet& sdf_net) override;


};
Expand Down
Empty file modified include/Planners/LazyThetaStarM1Mod.hpp
100644 → 100755
Empty file.
4 changes: 2 additions & 2 deletions include/Planners/LazyThetaStarM2.hpp
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -48,7 +48,7 @@ namespace Planners
* @param _target
* @return PathData
*/
virtual PathData findPath(const Vec3i &_source, const Vec3i &_target) override;
virtual PathData findPath(const Vec3i &_source, const Vec3i &_target, HIOSDFNet& sdf_net) override;

protected:

Expand Down Expand Up @@ -76,7 +76,7 @@ namespace Planners
* @param _dirs
* @return unsigned int
*/
inline virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs) override;
inline virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs, HIOSDFNet& sdf_net) override;

// Variable to ensure that the los is true between the parent of the current and one neighbour, so SetVertex function should not be executed
bool los_neighbour_{false}; /*!< TODO Comment */
Expand Down
2 changes: 1 addition & 1 deletion include/Planners/ThetaStar.hpp
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -80,7 +80,7 @@ namespace Planners
* This operation of erase and re-insert is performed in order to update the position
* of the node in the container.
*/
virtual void exploreNeighbours(Node* _current, const Vec3i &_target,node_by_position &_index_by_pos) override;
virtual void exploreNeighbours(Node* _current, const Vec3i &_target,node_by_position &_index_by_pos, HIOSDFNet& sdf_net) override;

utils::CoordinateListPtr checked_nodes, checked_nodes_current; /*!< TODO Comment */

Expand Down
2 changes: 1 addition & 1 deletion include/Planners/ThetaStarM1.hpp
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -76,7 +76,7 @@ namespace Planners
* @param _dirs Number of directions used (to distinguish between 2D and 3D)
* @return unsigned int The G Value calculated by the function
*/
inline virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs) override;
inline virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs, HIOSDFNet& sdf_net) override;

};

Expand Down
2 changes: 1 addition & 1 deletion include/Planners/ThetaStarM2.hpp
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -84,7 +84,7 @@ namespace Planners
* @param _dirs Number of directions used (to distinguish between 2D and 3D)
* @return unsigned int The G Value calculated by the function
*/
virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs) override;
virtual unsigned int computeG(const Node* _current, Node* _suc, unsigned int _n_i, unsigned int _dirs, HIOSDFNet& sdf_net) override;


};
Expand Down
31 changes: 31 additions & 0 deletions include/utils/FCNet.hpp
Original file line number Diff line number Diff line change
@@ -0,0 +1,31 @@
#ifndef HIOSDFNET_HPP
#define HIOSDFNET_HPP

#include <torch/torch.h>
#include <ros/ros.h>


// Sine non-linearity
struct Sine : torch::nn::Module {
torch::Tensor forward(torch::Tensor x);
};

// HIOSDFNet class
class HIOSDFNet : public torch::nn::Module {
public:
HIOSDFNet(int64_t in_features = 3, int64_t out_features = 1,
int64_t hidden_features = 256, int64_t num_hidden_layers = 4);

torch::Tensor forward(torch::Tensor x);
void eval();
void load_weights_from_tensor(torch::Tensor& tensor);

private:
torch::nn::Sequential net;

void sine_init(torch::nn::Module& module);
void first_layer_sine_init(torch::nn::Module& m);
};

#endif // HIOSDFNET_HPP

Empty file modified include/utils/LineOfSight.hpp
100644 → 100755
Empty file.
Empty file modified include/utils/SaveDataVariantToFile.hpp
100644 → 100755
Empty file.
Empty file modified include/utils/geometry_utils.hpp
100644 → 100755
Empty file.
Empty file modified include/utils/heuristic.hpp
100644 → 100755
Empty file.
Empty file modified include/utils/metrics.hpp
100644 → 100755
Empty file.
Empty file modified include/utils/misc.hpp
100644 → 100755
Empty file.
Empty file modified include/utils/ros/ROSInterfaces.hpp
100644 → 100755
Empty file.
Empty file modified include/utils/time.hpp
100644 → 100755
Empty file.
Empty file modified include/utils/utils.hpp
100644 → 100755
Empty file.
Empty file modified include/utils/world.hpp
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/c_loops.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/c_loops.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/cell.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/cell.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/cmd_line.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/common.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/common.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/config.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/container.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/container.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/container_prd.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/container_prd.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/pre_container.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/pre_container.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/rad_option.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/unitcell.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/unitcell.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/v_base.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/v_base.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/v_base_wl.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/v_compute.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/v_compute.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/voro++.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/voro++.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/wall.cc
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/wall.hh
100644 → 100755
Empty file.
Empty file modified include/voro++-0.4.6/src/worklist.hh
100644 → 100755
Empty file.
Empty file modified launch/plan_random_path.launch
100644 → 100755
Empty file.
Empty file modified launch/planner.launch
100644 → 100755
Empty file.
Empty file modified launch/planner2d_example.launch
100644 → 100755
Empty file.
Empty file modified launch/utils/create_octomap.launch
100644 → 100755
Empty file.
6 changes: 6 additions & 0 deletions package.xml
100644 → 100755
Original file line number Diff line number Diff line change
Expand Up @@ -12,10 +12,12 @@
<build_depend>geometry_msgs</build_depend>
<build_depend>visualization_msgs</build_depend>
<build_depend>std_msgs</build_depend>
<build_depend>sensor_msgs</build_depend>
<build_depend>nav_msgs</build_depend>
<build_depend>pcl_ros</build_depend>
<build_depend>pcl_conversions</build_depend>
<build_depend>roscpp</build_depend>
<build_depend>rospy</build_depend>
<build_depend>octomap_ros</build_depend>
<build_depend>octomap_server</build_depend>
<build_depend>costmap_2d</build_depend>
Expand All @@ -26,9 +28,11 @@
<build_depend>eigen</build_depend>

<build_export_depend>std_msgs</build_export_depend>
<build_export_depend>sensor_msgs</build_export_depend>
<build_export_depend>visualization_msgs</build_export_depend>
<build_export_depend>geometry_msgs</build_export_depend>
<build_export_depend>roscpp</build_export_depend>
<build_export_depend>rospy</build_export_depend>
<build_export_depend>nav_msgs</build_export_depend>
<build_export_depend>pcl_ros</build_export_depend>
<build_export_depend>pcl_conversions</build_export_depend>
Expand All @@ -43,8 +47,10 @@
<exec_depend>geometry_msgs</exec_depend>
<exec_depend>visualization_msgs</exec_depend>
<exec_depend>roscpp</exec_depend>
<exec_depend>rospy</exec_depend>
<exec_depend>nav_msgs</exec_depend>
<exec_depend>std_msgs</exec_depend>
<exec_depend>sensor_msgs</exec_depend>
<exec_depend>pcl_ros</exec_depend>
<exec_depend>pcl_conversions</exec_depend>
<exec_depend>octomap_ros</exec_depend>
Expand Down
Empty file modified resources/2dmaps/big_lab.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/big_lab.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/big_lab_map_v2.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/big_lab_map_v2.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/large/random0_1.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/large/random0_1.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/large/random0_2.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/large/random0_2.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/large/random0_3.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/large/random0_3.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/large/random0_4.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/large/random0_4.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/large/random0_5.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/large/random0_5.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/medium/random0_1.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/medium/random0_1.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/medium/random0_2.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/medium/random0_2.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/medium/random0_3.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/medium/random0_3.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/medium/random0_4.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/medium/random0_4.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/medium/random0_5.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/medium/random0_5.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/small/random0_1.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/small/random0_1.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/small/random0_2.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/small/random0_2.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/small/random0_3.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/small/random0_3.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/small/random0_4.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/small/random0_4.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/small/random0_5.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/small/random0_5.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/sparse/random0_01.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/sparse/random0_01.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/sparse/random0_02.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/sparse/random0_02.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/sparse/random0_03.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/sparse/random0_03.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/sparse/random0_04.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/sparse/random0_04.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/sparse/random0_05.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/random_maps/sparse/random0_05.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/robbi_1.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/robbi_1.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/robbi_2.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/robbi_2.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/test.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/test.yaml
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/tunnel.pgm
100644 → 100755
Empty file.
Empty file modified resources/2dmaps/tunnel.yaml
100644 → 100755
Empty file.
Binary file added resources/3dmaps/Atlas_8_puertas_02.bt
Binary file not shown.
Empty file modified resources/images/2dexample.png
100644 → 100755
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Empty file modified resources/images/3dexample.png
100644 → 100755
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Empty file modified resources/images/laberynth.png
100644 → 100755
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Empty file modified resources/images/manufacturing.png
100644 → 100755
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Empty file modified resources/images/maze.png
100644 → 100755
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Empty file modified resources/images/mbzirc.png
100644 → 100755
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Empty file modified resources/images/test.png
100644 → 100755
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Empty file modified resources/images/two_blocks.png
100644 → 100755
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Empty file modified resources/images/wall.png
100644 → 100755
Loading
Sorry, something went wrong. Reload?
Sorry, we cannot display this file.
Sorry, this file is invalid so it cannot be displayed.
Empty file modified rviz/planners.rviz
100644 → 100755
Empty file.
Empty file modified rviz/planners_2d.rviz
100644 → 100755
Empty file.
Loading

0 comments on commit 970e452

Please sign in to comment.