Advertisement
Guest User

Untitled

a guest
Jul 28th, 2021
259
0
Never
Not a member of Pastebin yet? Sign Up, it unlocks many cool features!
C++ 1.57 KB | None | 0 0
  1. ```
  2. Arduino: 1.8.15 (Linux), Board: "ESP32 Dev Module, Disabled, Default 4MB with spiffs (1.2MB APP/1.5MB SPIFFS), 240MHz (WiFi/BT), QIO, 80MHz, 4MB (32Mb), 921600, None"
  3.  
  4. /home/ubuntu/Arduino/***/*****.ino: In member function 'void MotorControlInterface::TaskMotorControl(void*)':
  5. *****:79:131: error: no matching function for call to 'ros::NodeHandle_<ArduinoHardware>::subscribe(const char [9], int, void (MotorControlInterface::*)(const geometry_msgs::Twist&), MotorControlInterface*)'
  6.        ros::Subscriber<geometry_msgs::Twist> twist_sub = nh.subscribe(cmd_vel_topic, 1, &MotorControlInterface::twistCallback, this);
  7.                                                                                                                                    ^
  8. In file included from /home/ubuntu/Arduino/libraries/ros_lib/ros.h:38:0,
  9.                  from /home/ubuntu/Arduino/*****/*****.ino:28:
  10. /home/ubuntu/Arduino/libraries/ros_lib/ros/node_handle.h:406:8: note: candidate: bool ros::NodeHandle_<Hardware, MAX_SUBSCRIBERS, MAX_PUBLISHERS, INPUT_SIZE, OUTPUT_SIZE>::subscribe(ros::Subscriber_&) [with Hardware = ArduinoHardware; int MAX_SUBSCRIBERS = 25; int MAX_PUBLISHERS = 25; int INPUT_SIZE = 512; int OUTPUT_SIZE = 512]
  11.    bool subscribe(Subscriber_& s)
  12.         ^
  13. /home/ubuntu/Arduino/libraries/ros_lib/ros/node_handle.h:406:8: note:   candidate expects 1 argument, 4 provided
  14.  
  15. exit status 1
  16. no matching function for call to 'ros::NodeHandle_<ArduinoHardware>::subscribe(const char [9], int, void (MotorControlInterface::*)(const geometry_msgs::Twist&), MotorControlInterface*)'
  17.  
  18. ```
Advertisement
Add Comment
Please, Sign In to add comment
Advertisement