Hi @zhahaoyu, judging by this post Interfacing mavros with gazebo SITL I supose you succeeded running mavros with gazebo SITL. I am trying to follow the same tutorial https://dev.px4.io/ros-mavros-offboard.html as you did but I have some questions.
- Should I create my catkin work-space within sitl_gazebo? So far I am using a catkin work-space located in my home directory.
- I am trying to modify the CMakelists.txt of the package including the offb_node.cpp, specificly I am including:
add_executable(offb_node src/offb_node.cpp)
target_link_libraries(offb_node ${catkin_LIBRARIES})
add_dependencies(offb_node ${${PROJECT_NAME}_EXPORTED_TARGETS} ${catkin_EXPORTED_TARGETS})
But I don’t know how should I modify the dependencies.