ROS on Windows does not recognize catkin command

asked 2022-10-18 10:07:04 -0500

Zivi80301 gravatar image

updated 2022-10-24 04:00:20 -0500

I am very new to ROS and am trying to make a Windows setup to follow along with the "Programming for Robotics (ROS)" lecture series by ETH on youtube https://www.youtube.com/watch?v=0BxVP....

I have so far installed ROS for Windows according to http://wiki.ros.org/Installation/Windows and run

c: \opt\ros\noetic\x64\setup.bat

which is, as far as i understand the windows equivalent to

source /opt/ros/indigo/setup.bash

in the lecture at 8:53. This generated no output and was followed by

roscore

which generated the following output:

... logging to C:\Users\ARTORG\.ros\log\dd367508-4edf-11ed-97ea-005056c00008\roslaunch-DESKTOP-5LL9QPM-5368.log
Checking log directory for disk usage. This may take a while.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.
started roslaunch server http://127.0.0.1:50379/
ros_comm version 1.15.9

SUMMARY
========

PARAMETERS
 * /rosdistro: noetic
 * /rosversion: 1.15.9

NODES

auto-starting new master
process[master]: started with pid [1536]
ROS_MASTER_URI=http://127.0.0.1:11311/
setting /run_id to dd367508-4edf-11ed-97ea-005056c00008
process[rosout-1]: started with pid [8432]
started core service [/rosout]

The examples which fallowed

  rosrun roscpp_tutorials talker
  rosnode list
  rosnode info /talker
  rostopic info /chatter
  rostopic type /chatter
  rostopic echo /chatter
  rostopic hz /chatter
  rosrun roscpp_tutorials listener
  rosnode list
  rostopic info /chatter
  rostopic pub /chatter std_msgs/String 
  "data: 'ETH Zurich ROS Course'"

all worked as expected. I then tried to setup my catkin workspace. This is where my problems start. At 23:24 the lecture advises to navigate to

 cd ~/catkin_ws

and use

catkin build

which resulted in

'catkin' is not recognized as an internal or external command, operable program or batch file.

i furthermore could not find the folders src, build and devel or use the commands

catkin clean

and

catkin config

seen at 26:06 and 26:32 as they both resulted in the same output.

I then found this page: https://github.com/Brabalawuka/RosOnW... and followed the instructions up to and including 5.

Using

catkin_make

generated the folder structure at the desired location. Furthermore, this command generated the output

Base path: C:\opt\ros\noetic\x64\my_catkin_ws
Source space: C:\opt\ros\noetic\x64\my_catkin_ws\src
Build space: C:\opt\ros\noetic\x64\my_catkin_ws\build
Devel space: C:\opt\ros\noetic\x64\my_catkin_ws\devel
Install space: C:\opt\ros\noetic\x64\my_catkin_ws\install
####
#### Running command: "ninja build.ninja" in "C:\opt\ros\noetic\x64\my_catkin_ws\build"
####
ninja: no work to do.
####
#### Running command: "ninja -j4 -l4" in "C:\opt\ros\noetic\x64\my_catkin_ws\build"
####
ninja: no work to do.

However, using any of the aforementioned

catkin

commands still resulted in the same error message.

I then found this thread: https://answers.ros.org/question/3495... of someone experiencing a similar problem. Following the advice in the given answer, I can generate the output

C:/opt/ros/noetic/x64/my_catkin_ws/src;c:\opt\ros\noetic\x64\share

in the window in which i called

c:\opt\ros\noetic\x64\my_catkin_ws\devel\setup ...
(more)
edit retag flag offensive close merge delete