All Projects → mcgill-robotics → ros-tritech-micron

mcgill-robotics / ros-tritech-micron

Licence: GPL-2.0 License
🔊 Tritech Micron SONAR ROS driver

Programming Languages

python
139335 projects - #7 most used programming language
CMake
9771 projects

Projects that are alternatives of or similar to ros-tritech-micron

spinnaker sdk camera driver
Point Grey (FLIR) Spinnaker based camera driver (Blackfly S etc.)
Stars: ✭ 106 (+457.89%)
Mutual labels:  driver, ros
Ds4 driver
DualShock 4 driver for ROS
Stars: ✭ 28 (+47.37%)
Mutual labels:  driver, ros
Ardupilot
ArduPlane, ArduCopter, ArduRover, ArduSub source
Stars: ✭ 6,637 (+34831.58%)
Mutual labels:  ros, auv
Robotiq
Robotiq packages (http://wiki.ros.org/robotiq)
Stars: ✭ 110 (+478.95%)
Mutual labels:  driver, ros
Ros canopen
CANopen driver framework for ROS (http://wiki.ros.org/ros_canopen)
Stars: ✭ 178 (+836.84%)
Mutual labels:  driver, ros
Create robot
ROS driver for iRobot Create 1 and 2.
Stars: ✭ 137 (+621.05%)
Mutual labels:  driver, ros
Grl
Robotics tools in C++11. Implements soft real time arm drivers for Kuka LBR iiwa plus V-REP, ROS, Constrained Optimization based planning, Hand Eye Calibration and Inverse Kinematics integration.
Stars: ✭ 105 (+452.63%)
Mutual labels:  driver, ros
riptide setup
The software packages which power The OSU Underwater Robotics Team's AUV.
Stars: ✭ 31 (+63.16%)
Mutual labels:  ros, auv
roboteq control
⚙️ Driver for Roboteq devices using ros_control
Stars: ✭ 32 (+68.42%)
Mutual labels:  driver, ros
arduino-sht
Repository for Sensirion humidity and temperature sensor support on Arduino
Stars: ✭ 43 (+126.32%)
Mutual labels:  driver
tarantool rs
Sync/Async tarantool database connector. WORK IN PROGRESS. DON'T SHARE THIS REPO
Stars: ✭ 14 (-26.32%)
Mutual labels:  driver
astuff sensor msgs
A set of messages specific to each sensor supported by AutonomouStuff.
Stars: ✭ 37 (+94.74%)
Mutual labels:  ros
mxu11x0
Mirror of MOXA UPort 11x0 USB to Serial Hub Family Driver
Stars: ✭ 23 (+21.05%)
Mutual labels:  driver
docker-dotnet-sonarscanner
🐳 Sonar Scanner MsBuild Dockerfile for dotNet Projects
Stars: ✭ 21 (+10.53%)
Mutual labels:  sonar
X99-Deluxe-II
Files for Asus X99 Deluxe II hackintosh.
Stars: ✭ 17 (-10.53%)
Mutual labels:  driver
igvc-software
The code base for the RoboNav team's IGVC robot.
Stars: ✭ 78 (+310.53%)
Mutual labels:  ros
reinforced-race
A model car learns driving along a track using reinforcement learning
Stars: ✭ 37 (+94.74%)
Mutual labels:  driver
SASensorProcessing
ROS node to create pointcloud out of stereo images from the KITTI Vision Benchmark Suite
Stars: ✭ 26 (+36.84%)
Mutual labels:  ros
Si446x
Si4463 Radio Library for AVR and Arduino
Stars: ✭ 52 (+173.68%)
Mutual labels:  driver
RosSwift
ROS Robotic Operating System - Swift implementation of core client libraries and rosmaster. Based on roscpp.
Stars: ✭ 37 (+94.74%)
Mutual labels:  ros

Tritech Micron ROS Package

status

This ROS package configures and communicates with the Tritech Micron sonar. This has only been tested on ROS Indigo, Jade, and Kinetic over RS232.

Setting up

You must clone this repository as tritech_micron into your catkin workspace's src directory:

roscd
cd src
git clone https://github.com/mcgill-robotics/ros-tritech-micron.git tritech_micron

Dependencies

Before proceeding, make sure to install all the dependencies by running:

rosdep update
rosdep install tritech_micron

Compiling

You must compile this package before being able to run it. You can do so by running:

catkin_make

from the root of your workspace.

Running

To run, simply connect the Tritech Micron sonar over RS232 and launch the package with:

roslaunch tritech_micron tritech_micron.launch port:=</path/to/sonar> frame:=<frame_id>

port and frame are run-time ROS launch arguments:

  • port: Serial port to read from, default: /dev/sonar.
  • frame: tf frame to stamp the messages with, default: sonar.

The package will keep trying to connect to the sonar until it is successful.

The tritech_micron node will output to the following ROS topics:

  • ~scan: PointCloud message. Scan data of the current heading only.
  • ~heading: PoseStamped message. Current heading of the sonar.
  • ~config: TritechMicronConfig message. Sonar config published on change.

Configuring

To configure the Tritech Micron sonar, take a look at the parameters defined in Scan.cfg.

These paramaters can also be updated on the fly with ROS dynamic_reconfigure as such:

rosrun rqt_reconfigure rqt_reconfigure

Visualizing

The scan data can be conveniently visualized with rviz. Simply, add the tritech_micron/scan topic as a PointCloud message to the view and make sure to set the Decay Time parameter to the number of seconds it takes to run a full scan in order to see the full scan at once instead of only one slice.

If done properly, you should be able to see something like this: Tritech Micron scan data

Note that the project description data, including the texts, logos, images, and/or trademarks, for each open source project belongs to its rightful owner. If you wish to add or remove any projects, please contact us at [email protected].