aboutsummaryrefslogtreecommitdiff
path: root/src
diff options
context:
space:
mode:
authorRoman Bapst <romanbapst@yahoo.de>2014-12-29 14:03:37 +0100
committerRoman Bapst <romanbapst@yahoo.de>2014-12-29 14:03:37 +0100
commit3e941a2d1f4919f05beee0672211efb35bfb816d (patch)
treed39b1d65ec290e0a3e597b841146d601ee83b9a6 /src
parent2c12a524de2c16b33722d2d128515cfd21367b4d (diff)
downloadpx4-firmware-3e941a2d1f4919f05beee0672211efb35bfb816d.tar.gz
px4-firmware-3e941a2d1f4919f05beee0672211efb35bfb816d.tar.bz2
px4-firmware-3e941a2d1f4919f05beee0672211efb35bfb816d.zip
progress on att_estimator node
Diffstat (limited to 'src')
-rw-r--r--src/platforms/ros/nodes/att_estimator/att_estimator.cpp7
1 files changed, 4 insertions, 3 deletions
diff --git a/src/platforms/ros/nodes/att_estimator/att_estimator.cpp b/src/platforms/ros/nodes/att_estimator/att_estimator.cpp
index 986412a1d..fa021fff0 100644
--- a/src/platforms/ros/nodes/att_estimator/att_estimator.cpp
+++ b/src/platforms/ros/nodes/att_estimator/att_estimator.cpp
@@ -39,14 +39,15 @@
*/
#include "ros/ros.h"
-#include "std_msgs/String.h"
+#include <gazebo_msgs/ModelStates.h>
+//#include "std_msgs/String.h"
/**
* This tutorial demonstrates simple receipt of messages over the ROS system.
*/
-void chatterCallback(const std_msgs::String::ConstPtr& msg)
+void chatterCallback(const gazebo_msgs::ModelStates &msg)
{
- ROS_INFO("I heard: [%s]", msg->data.c_str());
+ // try to read out message here
}
int main(int argc, char **argv)