mavlink / mavros

MAVLink to ROS gateway with proxy for Ground Control Station
Other
879 stars 989 forks source link

No `mavros/local_position/local` Topic #480

Closed weiweikong closed 8 years ago

weiweikong commented 8 years ago

I installed mavros by

sudo apt-get install ros-indigo-ros*

and connected with Pixhawk (Stable Firmware) by

roslauch mavros px4.launch

I could get the topics and received data correctly such as imu/data, local_position/pose and local_position/velocity, however, there was no topic named local_position/local. Also, I checked the ROS wiki (http://wiki.ros.org/mavros#mavros.2BAC8-Plugins.local_position), where did not introduce such topic. So I am confused about this topic?

LorenzMeier commented 8 years ago

@vooon Do you still need to arm to get those? It would seem like this should not depend on arming.

vooon commented 8 years ago

@LorenzMeier i'm not sure about publishing rates, but i think question not about "not publishing" issue.

@weiweikong Use rostopic list! And i'm pretty sure you missed ~ symbol, which means private node namespace (/mavros by default).

weiweikong commented 8 years ago

@LorenzMeier @vooon I tried some further test.

mavros without arming the system

mavros with arming the system

rostopic ehco /mavros/local_position/pose

snapshot34

weiweikong commented 8 years ago

I checked the Pull https://github.com/mavlink/mavros/pull/420, and in master branch, the local_position.cpp has, https://github.com/mavlink/mavros/blob/master/mavros/src/plugins/local_position.cpp#L50-L51, renamed the publish nodes from local_position/local to

local_position = lp_nh.advertise<geometry_msgs::PoseStamped>("pose", 10);
local_velocity = lp_nh.advertise<geometry_msgs::TwistStamped>("velocity", 10);

So, it could be no /mavros/local_position/local topic in current version, no matter installing from master branch from github or using sudo apt-get install ros-indigo-mavros*.

vooon commented 8 years ago

Yes, just use ~local_position/pose.