Control copter with /mavros/rc/override ROS topic

Hi, I’m trying to set motor’s PWM publishing to /mavros/rc/override topic but I get no results and just get the message: "No handlers could be found for logger “rosout”.

I’m using Erle Brain 3 with the default ArduCopter firmware. Running amp.service, ros.service and mavros.service.
Trying to set PWMs using the command below:
$ rostopic pub /mavros/rc/override mavros_msgs/OverrideRCIn “channels: [1500, 1500, 1500, 1550, 1500, 1500, 1500, 1500]” -r 130

Does anyone know the proper way to do it?

Best,
Filipe

Hi @filiperosa,

ROS master is working well?

Paste here the output of:

sudo systemctl status -l ros.service

Regards,

@LanderU

Hi @LanderU,
this is the output I get:

  • ros.service - ROS Kinetic service
    Loaded: loaded (/lib/systemd/system/ros.service; enabled)
    Active: active (running) since Wed 2017-12-20 19:17:14 UTC; 1h 19min ago
    Main PID: 573 (bash)
    CGroup: /system.slice/ros.service
    |-573 bash /opt/ros/kinetic/setup-ros.bash
    |-846 /usr/bin/python /opt/ros/kinetic/bin/roscore
    |-890 /usr/bin/python /opt/ros/kinetic/bin/rosmaster --core -p 11311 -w 3 __log:=/root/.ros/log/64b024d8-e5ba-11e7-b175-b827ebaae132/master.log
    `-938 /opt/ros/kinetic/lib/rosout/rosout __name:=rosout __log:=/root/.ros/log/64b024d8-e5ba-11e7-b175-b827ebaae132/rosout-1.log

Dec 20 19:17:14 erle-brain-3 systemd[1]: Started ROS Kinetic service.

Is there anything to add on this topic?
I am having the same issue…

I should say when I can do rostopic echo to any topic that is not mavros. When I do rostopic info to a mavros topic i get something like this

erle@erle-brain-3 ~ $ rostopic info /mavros/imu/data
No handlers could be found for logger “rosout”
Type: sensor_msgs/Imu

Publishers:

Subscribers: None

Thanks,
Hugo

excuse me, can i have your mavros rc override program, i just learned about it