Wiki

Package Summary

Maintainer status: maintained

Maintainer: Rocwang <825213566@qq.com>

Download: https://github.com/yowlings/wit_node.git

Author: Rocwang

License: BSD

This is the ROS nodelet package for wit motion company imu and gps sensor. Providing driver, ros driver and nodelet intergrating program.The wit motion 9-axies IMU and GPS module provides abundant types of data for user, including nine axises data, atmosphere pressure, temperature, latitude,longitude, altitude, satellites number .etc

wit.jpg

Usage

Launch the only ROS launch file:

roslaunch wit_node wit.launch

Dependencies and Install

1. ROS

2. ros-<distro>-ecl

Install ecl by

sudo apt install ros-<distro>-ecl

Nodes

wit

The wit ros node for getting IMU&GPS module data and publishing related topics.

Subscribed Topics

~<name>/reset_offset (std_msgs/Empty)

Published Topics

~<name>/raw_data (wit_node/ImuGpsRaw) /imu (sensor_msgs/Imu) /gps (sensor_msgs/NavSatFix) ~<name>/related_yaw (std_msgs/Float64)

Parameters

~port (string, default: /dev/ttyUSB0)

Wiki: wit_node (last edited 2020-01-07 08:45:45 by rocwang)