ROS Resources: Documentation | Support | Discussion Forum | Index | Service Status | ros @ Robotics Stack Exchange
Ask Your Question

Fxaxo's profile - activity

2022-09-19 17:51:56 -0500 marked best answer fatal error: Geometry_msgs/Vector3Stamped.h directory not found

i tried to use this Github File: https://github.com/ros-drivers/um7.git i used git clone to download it, changed the CMakeLists.txt and tried the Command catkin_make. But it doesnt work i get the fatal Error back. I used already the geometry_msgs/Vector3 without problems but Vector3Stamped doesnt work... is there any Library to replace it ? or do anybody have a tip what i can Install to let it work ?

i use a Raspberry Pi4, Ubuntu 20.04 (focal) and Ros Noetic

i added the first the Error output, then the changes in the CMakeLists.txt and then the complete cpp File here :

Error if i let geometry_msgs/Vector3Stamped.h active :

/home/ubuntu/um7_driver/src/um7/src/main.cpp:37:10: fatal error: geometry_msgs/Vector3Stamped.h: No such file or directory 37 | #include "geometry_msgs/Vector3Stamped.h" | ^~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~ compilation terminated. make[2]: * [CMakeFiles/um7_driver_2.dir/build.make:63: CMakeFiles/um7_driver_2.dir/um7/src/main.cpp.o] Error 1 make[1]: [CMakeFiles/Makefile2:1097: CMakeFiles/um7_driver_2.dir/all] Error 2 make[1]: Waiting for unfinished jobs.... [ 1%] Built target std_msgs_generate_messages_cpp [ 1%] Built target _actionlib_msgs_generate_messages_check_deps_GoalStatus [ 1%] Built target _rosserial_msgs_generate_messages_check_deps_TopicInfo make: * [Makefile:141: all] Error 2

Invoking "make -j4 -l4" failed

Error if i comment geometry_msgs/Vector3Stamped out:

/home/ubuntu/um7_driver/src/um7/src/main.cpp:38:10: fatal error: ros/ros.h: No such file or directory 38 | #include "ros/ros.h" | ^~~~~~~~~~~ compilation terminated. make[2]: * [CMakeFiles/um7_driver_2.dir/build.make:63: CMakeFiles/um7_driver_2.dir/um7/src/main.cpp.o] Error 1 make[1]: [CMakeFiles/Makefile2:1097: CMakeFiles/um7_driver_2.dir/all] Error 2 make[1]: Waiting for unfinished jobs.... [ 1%] Built target std_msgs_generate_messages_nodejs [ 1%] Built target _actionlib_msgs_generate_messages_check_deps_GoalID [ 1%] Built target _actionlib_msgs_generate_messages_check_deps_GoalStatusArray make: * [Makefile:141: all] Error 2 Invoking "make -j4 -l4" failed

Changes in CMakeLists.txt :

catkin_workspace()

include_directories( ${catkin_INCLUDE_DIRS})

add_executable( um7_driver_2 /home/ubuntu/um7_driver/src/um7/src/main.cpp ) target_link_libraries( um7_driver_2 ${catkin_LIBRARIES} )


the new CMakeLists.txt:

cmake_minimum_required(VERSION 2.8.3) project(um7_test)

find_package(catkin REQUIRED COMPONENTS roscpp serial sensor_msgs message_generation)

add_service_files( FILES Reset.srv )

generate_messages()

catkin_package( INCLUDE_DIRS include CATKIN_DEPENDS message_runtime )

#

Build

#

Specify additional locations of header files

Your package locations should be listed before other locations

include_directories(include ${catkin_INCLUDE_DIRS} )

Declare a cpp executable

add_executable(um7_driver src/main.cpp src/registers.cpp src/comms.cpp) target_link_libraries(um7_driver ${catkin_LIBRARIES} ) add_dependencies(um7_driver um7_generate_messages_cpp)

#

Install

#

install(TARGETS um7_driver RUNTIME DESTINATION ${CATKIN_PACKAGE_BIN_DESTINATION} )

#

Testing

#

if(CATKIN_ENABLE_TESTING) find_package(roslint REQUIRED) catkin_add_gtest(${PROJECT_NAME}_test_registers test/test_registers.cpp src/registers.cpp) catkin_add_gtest(${PROJECT_NAME}_test_comms test/test_comms.cpp src/comms.cpp src/registers.cpp) target_link_libraries(${PROJECT_NAME}_test_comms util ${catkin_LIBRARIES})

file(GLOB LINT_SRCS src/*.cpp include/um7/registers.h include/um7/comms.h) roslint_cpp(${LINT_SRCS}) roslint_add_test() endif()

include_directories( ${catkin_INCLUDE_DIRS})

add_executable( um7_driver_2 /home/ubuntu/um7_driver/src/um7/src/main.cpp ) target_link_libraries( um7_driver_2 ${catkin_LIBRARIES} )


Complete cpp File main.cpp:

/** * * \file * \brief Main entry point for UM7 driver. Handles serial connection * details, as well as all ROS message stuffing, parameters, * topics, etc. * \author Mike Purvis mpurvis@clearpathrobotics.com (original code for UM6) * \copyright Copyright (c) 2013, Clearpath Robotics, Inc. * \author Alex Brown rbirac@cox.net ... (more)

2022-08-06 06:12:10 -0500 received badge  Famous Question (source)
2022-02-18 07:15:33 -0500 received badge  Famous Question (source)
2021-07-25 12:01:04 -0500 received badge  Notable Question (source)
2021-07-21 07:17:27 -0500 commented question Error: Reset is not a member of um7

srry you r right i added the link in the question ! hm that means i should try an different driver ?

2021-07-21 07:16:25 -0500 edited question Error: Reset is not a member of um7

Error: Reset is not a member of um7 I use an Raspberry Pi4 Model b with the Operation system Ubuntu 20.04 and Ros Vers.

2021-07-21 07:03:20 -0500 received badge  Popular Question (source)
2021-07-21 05:58:32 -0500 edited question Error: Reset is not a member of um7

/home/ubuntu/um7_driver/src/um7/src/main.cpp:529:63: error: ‘Reset’ is not a member of ‘um7’ 529 | ros::Service

2021-07-21 05:55:50 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-21 05:55:37 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-21 05:55:10 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-21 05:54:47 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-21 05:53:01 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-21 05:52:45 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-21 05:51:22 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-21 05:50:41 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-21 05:50:35 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-21 05:50:11 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-21 04:59:25 -0500 edited question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-16 08:24:12 -0500 asked a question Error: Reset is not a member of um7

error: ‘const StringType’ {aka ‘const class std::__cxx11::basic_string<char>’} has no member named ‘size’ 266 |

2021-07-08 03:51:56 -0500 edited question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

fatal error: Geometry_msgs/Vector3Stamped.h directory not found i tried to use this Github File: https://github.com/ros-

2021-07-08 03:50:19 -0500 commented question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

i found a CMakeLists.txt wich i copied and configured for my Project do this fit more in the regular CMakeLists ? i add

2021-07-08 03:41:22 -0500 received badge  Enthusiast
2021-07-06 03:52:06 -0500 commented question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

oh okay i will search and keep u updated when i find the solution ! thank you ! @Mike Scheutzow

2021-07-06 03:51:17 -0500 commented question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

oh okay i will search and keep u updated when i find the solution ! thank you ! @MikeScheutzow

2021-07-05 10:12:50 -0500 commented question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

hm i compared my CMakeLists to many others who using the lib ros/ros.h and i didnt found anything wrong ... i added the

2021-07-05 10:10:55 -0500 edited question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

fatal error: Geometry_msgs/Vector3Stamped.h directory not found i tried to use this Github File: https://github.com/ros-

2021-07-05 08:17:39 -0500 received badge  Notable Question (source)
2021-07-05 07:52:19 -0500 commented question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

oh okaz i understand ! okaz i postet the error output in the question. i already tried to install some sudo apt-get plug

2021-07-05 07:49:05 -0500 edited question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

fatal error: Geometry_msgs/Vector3Stamped.h directory not found i tried to use this Github File: https://github.com/ros-

2021-07-05 04:30:52 -0500 edited question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

fatal error: Geometry_msgs/Vector3Stamped.h directory not found i tried to use this Github File: https://github.com/ros-

2021-07-05 04:30:52 -0500 received badge  Editor (source)
2021-07-05 03:48:32 -0500 answered a question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

hello Guys thanks for the advice ! you r absolutly right i wrote the question a little bit too fast srry ! i tooked a s

2021-07-05 03:43:28 -0500 edited question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

fatal error: Geometry_msgs/Vector3Stamped.h directory not found i tried to use this Github File: https://github.com/ros-

2021-07-05 02:59:16 -0500 received badge  Popular Question (source)
2021-07-02 07:50:04 -0500 asked a question fatal error: Geometry_msgs/Vector3Stamped.h directory not found

fatal error: Geometry_msgs/Vector3Stamped.h directory not found i tried to use this Github File: https://github.com/ros-

2021-06-26 21:38:00 -0500 received badge  Notable Question (source)
2021-06-24 04:12:56 -0500 received badge  Popular Question (source)
2021-06-20 10:10:38 -0500 received badge  Popular Question (source)
2021-06-20 10:10:38 -0500 received badge  Notable Question (source)
2021-06-16 03:56:31 -0500 asked a question i dont really know how to solve this Problem because i think i need the filter command but i get this as output : Attribute Error "filter" has no Attribute A

i dont really know how to solve this Problem because i think i need the filter command but i get this as output : Attrib

2021-06-10 03:22:56 -0500 received badge  Supporter (source)
2021-06-10 03:22:52 -0500 marked best answer rviz Fixed frame error No TF Data

i tried to visualize a UM7 Sensor from Redshift Labs ! with rotopic list i receive my /imu/data ! with rostopic echo i receive all my needed Data ( the Orientation of the Sensor ) and i can include the /imu/data in rviz IMU and can see that Messages receivin ! i can also include the Fabio_TF in the fixed Frame but when i try to start it i wont receive any Data in the rviz Window and there is the Error No TF Data marked in yellow!

this is my Publisher Node;

#!/usr/bin/env python3

import rospy                    # Library to use Python
import numpy as np
from geometry_msgs.msg import Point, Pose, Quaternion
from sensor_msgs.msg import Imu
from std_msgs.msg import Float32, Header    # Library to use IMU
from um7py import UM7Serial

############################################### Name of the Imu ######
imuData_pub = rospy.Publisher("/imu/data", Imu, queue_size=10)

############################################### Tranformation from Euler to Quat ######
def euler_to_quat(yaw, pitch, roll):
    q0 = np.sin(roll/2) * np.cos(pitch/2) * np.cos(yaw/2) - np.cos(roll/2) * np.sin(pitch/2) * np.sin(yaw/2)
    q1 = np.cos(roll/2) * np.sin(pitch/2) * np.cos(yaw/2) + np.sin(roll/2) * np.cos(pitch/2) * np.sin(yaw/2)
    q2 = np.cos(roll/2) * np.cos(pitch/2) * np.sin(yaw/2) - np.sin(roll/2) * np.sin(pitch/2) * np.cos(yaw/2)
    q3 = np.cos(roll/2) * np.cos(pitch/2) * np.cos(yaw/2) + np.sin(roll/2) * np.sin(pitch/2) * np.sin(yaw/2)
    return [q0, q1, q2, q3]

############################################## Read the Sensor
def read_um7():
    um7_serial = UM7Serial(port_name='/dev/ttyUSB0')

    for packet in um7_serial.recv_broadcast(num_packets = 1000):

        yaw = packet.yaw
        roll = packet.roll
        pitch = packet.pitch

        w1 = packet.roll_rate
        w2 = packet.pitch_rate
        w3 = packet.yaw_rate

############################################ Formula to change the Euler to Quaternion
        q0 = np.sin(roll/2) * np.cos(pitch/2) * np.cos(yaw/2) - np.cos(roll/2) * np.sin(pitch/2) * np.sin(yaw/2)
        q1 = np.cos(roll/2) * np.sin(pitch/2) * np.cos(yaw/2) + np.sin(roll/2) * np.cos(pitch/2) * np.sin(yaw/2)
        q2 = np.cos(roll/2) * np.cos(pitch/2) * np.sin(yaw/2) - np.sin(roll/2) * np.sin(pitch/2) * np.cos(yaw/2)
        q3 = np.cos(roll/2) * np.cos(pitch/2) * np.cos(yaw/2) + np.sin(roll/2) * np.sin(pitch/2) * np.sin(yaw/2)

############################################ Start Header Msgs
        Fabio_Imu.header.seq = 0            # Growing Var   
        Fabio_Imu.header.stamp = rospy.Time.now()   # Timestamp
        Fabio_Imu.header.frame_id = "Fabio_TF"  # Name of Frame

        Fabio_Imu.orientation.x = q0            # Quat Data in orient. Lib
        Fabio_Imu.orientation.y = q1
        Fabio_Imu.orientation.z = q2
        Fabio_Imu.orientation.w = q3

        #Fabio_Imu.angular_velocity.x = Quaternion[0]
        #Fabio_Imu.angular_velocity.y = Quaternion[0]
        #Fabio_Imu.angular_velocity.z = Quaternion[0]

        #Fabio_Imu.linear_acceleration.x = Quaternion[0]
        #Fabio_Imu.linear_acceleration.y = Quaternion[0]
        #Fabio_Imu.linear_acceleration.z = Quaternion[0]

        imuData_pub.publish(Fabio_Imu)      # Publish the Node

########################################################
############################## Main ####################
########################################################

if __name__ == '__main__':
    rospy.loginfo('UM7_Sensor started')         # just print command
    rospy.init_node('test_1_IMU')               # Name of Init_Node
    Fabio_Imu = Imu()
    while not ...
(more)
2021-06-10 03:22:52 -0500 received badge  Scholar (source)
2021-06-10 03:22:34 -0500 commented answer rviz Fixed frame error No TF Data

it worked !!! Thank you very much !!

2021-06-09 12:56:51 -0500 asked a question rviz Fixed frame error No TF Data

rviz Fixed frame error No TF Data i tried to visualize a UM7 Sensor from Redshift Labs ! with rotopic list i receive my