progress on att_estimator node

This commit is contained in:
Roman Bapst 2014-12-29 14:03:37 +01:00
parent 2c12a524de
commit 3e941a2d1f
1 changed files with 4 additions and 3 deletions

View File

@ -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)