ROS Basics in 5 Days Course - Run rosject

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.

It looks like you have it correct. Maybe you did some wrong compilations in the past and they are interfering your current compilation. Try deleting the compilation directories and then recompile.

cd ~/catkin_ws
rm -rf devel build
catkin_make

Then try to launch it again and let me know if that works

It didn’t work. I’m unsure where the issue lies!

This might be a sourcing problem. You need to run the source command on every terminal where you want to access the package, in addition to compiling and sourcing on one terminal:

source ~/catkin_ws/devel/setup.bash

This topic was automatically closed 5 days after the last reply. New replies are no longer allowed.