#include <ModelState.h>
Public Member Functions | |
virtual int | deserialize (unsigned char *inbuffer) |
const char * | getMD5 () |
const char * | getType () |
virtual int | serialize (unsigned char *outbuffer) const |
Public Attributes | |
char * | model_name |
geometry_msgs::Pose | pose |
char * | reference_frame |
geometry_msgs::Twist | twist |
Definition at line 14 of file ModelState.h.
virtual int gazebo_msgs::ModelState::deserialize | ( | unsigned char * | inbuffer | ) | [inline, virtual] |
Implements ros::Msg.
Definition at line 40 of file ModelState.h.
const char* gazebo_msgs::ModelState::getMD5 | ( | ) | [inline, virtual] |
Implements ros::Msg.
Definition at line 67 of file ModelState.h.
const char* gazebo_msgs::ModelState::getType | ( | ) | [inline, virtual] |
Implements ros::Msg.
Definition at line 66 of file ModelState.h.
virtual int gazebo_msgs::ModelState::serialize | ( | unsigned char * | outbuffer | ) | const [inline, virtual] |
Implements ros::Msg.
Definition at line 22 of file ModelState.h.
Definition at line 17 of file ModelState.h.
Definition at line 18 of file ModelState.h.
Definition at line 20 of file ModelState.h.
Definition at line 19 of file ModelState.h.