Hi All,
I’ve been spending several days trying to complete the Wall Follower project from the “ROS Basics in 5 Days” course using the simulation environment in The Construct WebShell.
At first, the project was going well — both Section 1 (topics) and Section 2 (services) worked perfectly. But after implementing Section 3 (actions), things started to break every time I launched the final node.
I keep encountering the following error:
ModuleNotFoundError: No module named ‘wall_follower.srv’; ‘wall_follower’ is not a package|
Project structure looks correct:
wall_follower/
├── action/OdomRecord.action
├── srv/FindWall.srv
├── scripts/
│ ├── wall_follower.py
│ ├── find_wall_server.py
│ └── record_odom_server.py
├── launch/main.launch
├── package.xml
└── CMakeLists.txt
-
CMakeLists.txt includes:
add_service_files(…)
add_action_files(…)
generate_messages(…)
catkin_package(…) with the correct dependencies -
package.xml includes: All required dependencies, including message_generation, message_runtime, geometry_msgs, actionlib, and actionlib_msgs
Ran catkin_make with no errors and sourced the setup files (source ~/catkin_ws/devel/setup.bash)
At this point, I’m not sure how to fix the problem.