@@ -10,29 +10,41 @@ For simplicity (not needing to fiddle with rviz), there is a built in visualizat
10
10
## Prerequisites
11
11
- ROS Noetic
12
12
- Python 3
13
- - [ catkin_tools] ( https://catkin-tools.readthedocs.io/en/latest/ )
14
- - [ PyTorch] ( https://pytorch.org/ )
15
- - OpenCV (` cv2 ` )
16
- - numpy, yaml
17
- - IGHAStar C++/CUDA requirements (requirements.txt)
18
- - ROS messages: ` nav_msgs ` , ` geometry_msgs ` , ` mavros_msgs ` , ` grid_map_msgs ` , ` visualization_msgs ` , ` diagnostic_msgs `
13
+ - IGHAStar C++/CUDA requirements (met with pip install -e .)
19
14
20
15
## Setup (confirm these instructions)
21
- 1 . ** Clone this repository** into your catkin workspace:
16
+ 1 . ** Install ROS dependencies:**
17
+ Assuming IGHA* has already been installed,
22
18
``` bash
23
- cd ~ /catkin_ws/src
24
- git clone < this-repo>
25
- cd ~ /catkin_ws
26
- catkin_make
27
- source devel/setup.bash
28
- ```
29
- 2 . ** Install Python dependencies:**
30
- ``` bash
31
- pip install torch opencv-python numpy pyyaml
19
+ # Install ROS packages for message types
20
+ sudo apt-get update
21
+ sudo apt-get install ros-noetic-grid-map-msgs \
22
+ ros-noetic-mavros-msgs \
23
+ ros-noetic-nav-msgs \
24
+ ros-noetic-geometry-msgs \
25
+ ros-noetic-sensor-msgs \
26
+ ros-noetic-visualization-msgs \
27
+ ros-noetic-diagnostic-msgs \
28
+ ros-noetic-tf
29
+
30
+ # Check for any missing dependencies
31
+ rosdep install --from-paths src --ignore-src -r -y
32
32
```
33
- 3 . ** Check ROS dependencies:**
33
+
34
+ 2 . ** Verify installation:**
34
35
``` bash
35
- rosdep install --from-paths src --ignore-src -r -y
36
+ # Test that all message types are available
37
+ python3 -c "
38
+ import rospy
39
+ from nav_msgs.msg import Path, Odometry
40
+ from mavros_msgs.msg import WaypointList
41
+ from grid_map_msgs.msg import GridMap
42
+ from visualization_msgs.msg import MarkerArray
43
+ from sensor_msgs.msg import NavSatFix
44
+ from diagnostic_msgs.msg import DiagnosticArray
45
+ from geometry_msgs.msg import PoseStamped, Quaternion
46
+ print('All ROS message types imported successfully!')
47
+ "
36
48
```
37
49
38
50
## Configuration
@@ -54,10 +66,8 @@ We provide rosbags that you can use to run the example script. Place them in the
54
66
```
55
67
2 . ** Run the planner node:**
56
68
``` bash
57
- cd examples/ROS
58
- python3 example.py
69
+ python3 examples/ROS/example.py
59
70
```
60
- Or launch with rosrun/roslaunch if you have a package setup.
61
71
3 . ** Play a rosbag or run your robot simulation** to publish the required topics.
62
72
```
63
73
cd examples/ROS/rosbags/
@@ -67,4 +77,3 @@ We provide rosbags that you can use to run the example script. Place them in the
67
77
## Visualization
68
78
- The planner will open an OpenCV window showing the costmap, elevation map, path, goal, and robot state.
69
79
- Path and goal are also published as ROS topics for use in RViz.
70
-
0 commit comments