Advertisement
Not a member of Pastebin yet?
Sign Up,
it unlocks many cool features!
- ```
- 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"
- /home/ubuntu/Arduino/***/*****.ino: In member function 'void MotorControlInterface::TaskMotorControl(void*)':
- *****:79:131: error: no matching function for call to 'ros::NodeHandle_<ArduinoHardware>::subscribe(const char [9], int, void (MotorControlInterface::*)(const geometry_msgs::Twist&), MotorControlInterface*)'
- ros::Subscriber<geometry_msgs::Twist> twist_sub = nh.subscribe(cmd_vel_topic, 1, &MotorControlInterface::twistCallback, this);
- ^
- In file included from /home/ubuntu/Arduino/libraries/ros_lib/ros.h:38:0,
- from /home/ubuntu/Arduino/*****/*****.ino:28:
- /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]
- bool subscribe(Subscriber_& s)
- ^
- /home/ubuntu/Arduino/libraries/ros_lib/ros/node_handle.h:406:8: note: candidate expects 1 argument, 4 provided
- exit status 1
- no matching function for call to 'ros::NodeHandle_<ArduinoHardware>::subscribe(const char [9], int, void (MotorControlInterface::*)(const geometry_msgs::Twist&), MotorControlInterface*)'
- ```
Advertisement
Add Comment
Please, Sign In to add comment
Advertisement