Skip to content

Commit f9f9291

Browse files
committed
updated README to address missing deps
1 parent 9cf35c9 commit f9f9291

File tree

1 file changed

+31
-22
lines changed

1 file changed

+31
-22
lines changed

examples/ROS/README.md

Lines changed: 31 additions & 22 deletions
Original file line numberDiff line numberDiff line change
@@ -10,29 +10,41 @@ For simplicity (not needing to fiddle with rviz), there is a built in visualizat
1010
## Prerequisites
1111
- ROS Noetic
1212
- 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 .)
1914

2015
## 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,
2218
```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
3232
```
33-
3. **Check ROS dependencies:**
33+
34+
2. **Verify installation:**
3435
```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+
"
3648
```
3749

3850
## Configuration
@@ -54,10 +66,8 @@ We provide rosbags that you can use to run the example script. Place them in the
5466
```
5567
2. **Run the planner node:**
5668
```bash
57-
cd examples/ROS
58-
python3 example.py
69+
python3 examples/ROS/example.py
5970
```
60-
Or launch with rosrun/roslaunch if you have a package setup.
6171
3. **Play a rosbag or run your robot simulation** to publish the required topics.
6272
```
6373
cd examples/ROS/rosbags/
@@ -67,4 +77,3 @@ We provide rosbags that you can use to run the example script. Place them in the
6777
## Visualization
6878
- The planner will open an OpenCV window showing the costmap, elevation map, path, goal, and robot state.
6979
- Path and goal are also published as ROS topics for use in RViz.
70-

0 commit comments

Comments
 (0)