Public Member Functions | |
void | imu_callback (const rosabridge_msgs::Imu::ConstPtr &imuMsg) |
ImuProxyNode () | |
int | run () |
Protected Attributes | |
std::string | imu_frame |
sensor_msgs::Imu | imu_msg |
ros::Publisher | imu_pub |
ros::Subscriber | imu_sub |
std::string | imu_topic |
ros::NodeHandle | nh |
Definition at line 19 of file imu_proxy_node.cpp.
ImuProxyNode::ImuProxyNode | ( | ) |
Definition at line 44 of file imu_proxy_node.cpp.
void ImuProxyNode::imu_callback | ( | const rosabridge_msgs::Imu::ConstPtr & | imuMsg | ) |
Definition at line 61 of file imu_proxy_node.cpp.
int ImuProxyNode::run | ( | ) |
Definition at line 90 of file imu_proxy_node.cpp.
|
protected |
Definition at line 39 of file imu_proxy_node.cpp.
|
protected |
Definition at line 33 of file imu_proxy_node.cpp.
|
protected |
Definition at line 31 of file imu_proxy_node.cpp.
|
protected |
Definition at line 32 of file imu_proxy_node.cpp.
|
protected |
Definition at line 40 of file imu_proxy_node.cpp.
|
protected |
Definition at line 30 of file imu_proxy_node.cpp.