#include <converters.hpp>
Public Member Functions | |
ImuRosToUavcan (ros::NodeHandle &ros_node, UavcanNode &uavcan_node, const char *ros_topic) | |
Private Member Functions | |
void | ros_callback (IN_ROS_MSG_PTR in_ros_msg) override |
Additional Inherited Members | |
![]() | |
typedef uavcan::equipment::ahrs::RawIMU | OUT_UAVCAN_MSG |
![]() | |
bool | enabled |
OUT_UAVCAN_MSG | out_uavcan_msg_ |
![]() | |
typedef sensor_msgs::Imu | IN_ROS_MSG |
typedef sensor_msgs::Imu ::Ptr | IN_ROS_MSG_PTR |
![]() | |
void | broadcast () |
RosToUavcanConverter (ros::NodeHandle &ros_node, UavcanNode &uavcan_node, const char *ros_topic, std::string name) | |
![]() | |
std::string | _name |
ros::Subscriber | ros_sub_ |
uavcan::Publisher< OUT_UAVCAN_MSG > | uavcan_pub_ |
Definition at line 228 of file converters.hpp.
|
inline |
Definition at line 233 of file converters.hpp.
|
overrideprivatevirtual |
Implements RosToUavcanConverter< sensor_msgs::Imu, uavcan::equipment::ahrs::RawIMU >.
Definition at line 155 of file converters.cpp.