fatal error: ros/ros.h: No such file or directory

asked 2022-11-17 04:22:21 -0500

Hey everyone, i stumbled upon a problem which i cant seem to solve. I tried and searched for possible solutions but nothing worked for me so i came to the conclusion to just post the files myself and ask for your help directly. The problem itself is that, as the title already states, my ros.h is not found. I have this issue with another file and another header as well. I have the feeling that my ROS is broken and i need to reinstall it, because so far no headers are being included. I wrote a simple "camera.cpp"-file with only the ROS Header, which i will post here with the CMake file. Weirdly the "camera.cpp" file has compiled and worked before but since two days ago i just wont function.

#include "ros/ros.h"


int main(int argc, char* argv[])
{
  ros::init(argc, argv, "vision_node");

  ros::NodeHandle nh;

  ROS_INFO("Hello, World!");

  ros::spin();
}

And here the CMake-File:

cmake_minimum_required(VERSION 3.0.2)
project(bachelorthesis)

## Compile as C++11, supported in ROS Kinetic and newer
# add_compile_options(-std=c++11)

## Find catkin macros and libraries
## if COMPONENTS list like find_package(catkin REQUIRED COMPONENTS xyz)
## is used, also find other catkin packages

find_package(catkin REQUIRED COMPONENTS
  roscpp
  rospy
  std_msgs
  ueye_cam
  cv_bridge
#  image_transport
#  camera_control_msgs
)

find_package(OpenCV REQUIRED)

set(CMAKE_AUTOMOC ON)
#find_package(Qt5 ${rviz_QT_VERSION} EXACT REQUIRED Core Widgets)
find_package(Qt5Widgets REQUIRED)

## System dependencies are found with CMake's conventions
# find_package(Boost REQUIRED COMPONENTS system)


## Uncomment this if the package has a setup.py. This macro ensures
## modules and global scripts declared therein get installed
## See http://ros.org/doc/api/catkin/html/user_guide/setup_dot_py.html
# catkin_python_setup()

################################################
## Declare ROS messages, services and actions ##
################################################

## To declare and build messages, services or actions from within this
## package, follow these steps:
## * Let MSG_DEP_SET be the set of packages whose message types you use in
##   your messages/services/actions (e.g. std_msgs, actionlib_msgs, ...).
## * In the file package.xml:
##   * add a build_depend tag for "message_generation"
##   * add a build_depend and a exec_depend tag for each package in MSG_DEP_SET
##   * If MSG_DEP_SET isn't empty the following dependency has been pulled in
##     but can be declared for certainty nonetheless:
##     * add a exec_depend tag for "message_runtime"
## * In this file (CMakeLists.txt):
##   * add "message_generation" and every package in MSG_DEP_SET to
##     find_package(catkin REQUIRED COMPONENTS ...)
##   * add "message_runtime" and every package in MSG_DEP_SET to
##     catkin_package(CATKIN_DEPENDS ...)
##   * uncomment the add_*_files sections below as needed
##     and list every .msg/.srv/.action file to be processed
##   * uncomment the generate_messages entry below
##   * add every package in MSG_DEP_SET to generate_messages(DEPENDENCIES ...)

## Generate messages in the 'msg' folder
# add_message_files(
#   FILES
#   Message1.msg
#   Message2.msg
# )

## Generate services in the 'srv' folder
# add_service_files(
#   FILES
#   Service1.srv
#   Service2.srv
# )

## Generate actions in the 'action' folder
# add_action_files(
#   FILES
#   Action1.action
#   Action2.action
# )

## Generate added messages and services with any dependencies listed here
# generate_messages(
#   DEPENDENCIES
#   std_msgs
# )

################################################
## Declare ROS dynamic reconfigure parameters ##
################################################

## To declare and build dynamic reconfigure parameters within this
## package, follow these steps:
## * In the file package.xml:
##   * add a build_depend and a ...
(more)
edit retag flag offensive close merge delete

Comments

Try compiling roscpp_tutorials . If you face the same problem, please reinstall ROS!

ravijoshi gravatar image ravijoshi  ( 2022-11-21 03:30:13 -0500 )edit