Only released in EOL distros:  

nao_rail: nao_openni | nao_speech | nao_vision

Package Summary

The nao_vision package contains a node to publish images from the NAO's on-board camera as a sensor_msgs/Image. Optional parameters can be set to set the resolution and select which camera to stream from. This package has been tested with NAOqi version 1.10.52.

nao_interaction: nao_audio | nao_interaction_launchers | nao_interaction_msgs | nao_vision

Package Summary

Package for the Nao robot, providing access to NAOqi vision proxies

nao_interaction: nao_audio | nao_interaction_launchers | nao_interaction_msgs | nao_vision

Package Summary

Package for the Nao robot, providing access to NAOqi vision proxies

nao_interaction: nao_audio | nao_interaction_launchers | nao_interaction_msgs | nao_vision

Package Summary

Package for the Nao robot, providing access to NAOqi vision proxies

nao_interaction: nao_audio | nao_interaction_launchers | nao_interaction_msgs | nao_vision

Package Summary

Package for the Nao robot, providing access to NAOqi vision proxies

Package Summary

Package for the Nao robot, providing access to NAOqi vision proxies

  • Maintainer status: maintained
  • Maintainer: Manos Tsardoulias <etsardou AT gmail DOT com>, Vincent Rabaud <vincent.rabaud AT gmail DOT com>
  • Author: Manos Tsardoulias
  • License: BSD

About

The nao_vision package allows easy control and access of the NAO's vision via ROS. These packages have been tested with NAOqi version 1.10.52.

Nodes

nao_vision

nao_vision can remotely stream images from an Aldebaran NAO's built in camera. By default, a 320x240 RGB image is streamed from the top camera and published on the nao_camera topic. Optional parameters can be set to change the resolution or change to the bottom camera.

Published Topics

nao_vision (sensor_msgs/Image)
  • Current image from the NAO's on-board camera.

Parameters

/naoqi/host (string)
  • Hostname used to communicate with the NAO.
/naoqi/port (integer)
  • Port used to communicate with the NAO.
/naoqi/path (string, default: null)
  • Optional path to the NAOqi /lib folder that can be used if your local PYTHONPATH does not include it.
~resolution (integer, default: 1=kQVGA)
  • Integer representation of the resolution as defined by the Nao video API. {0=kQQVGA, 1=kQVGA, 2=kVGA}
~camera (integer, default: 0=top-camera)
  • Integer representation of the camera to stream from as defined by the Nao video API. {0=top-camera, 1=bottom-camera}

Installation

To install the nao_rail stack, simply run the following commands in your shell:

   1 cd /path/to/your/ros/stacks
   2 git clone git://github.com/WPI-RAIL/nao_rail.git
   3 roscd nao_rail
   4 rosdep install nao_rail
   5 rosmake nao_rail

Startup

The nao_vision package contains a nao_vision.launch file which should be edited with the hostname and port of your NAO. Additionally, if your local PYTHONPATH does not include the path to your NAOqi /lib folder, an optional parameter can be set in the launch file. Parameters are also included to configure the resolution and the camera (bottom or top) that will be streamed. These are set to the default values in the given launch file. This file launches an instance of the nao_vision node. To launch this node, the following commands can be used:

  • roslaunch nao_vision nao_vision.launch

With the above node running, you can test video streaming with the image_view package using the following command:

  • rosrun image_view image_view image:=/nao_camera

Support

Please send bug reports to the GitHub Issue Tracker. Feel free to contact me at any point with questions and comments.


wpi.png

rail.png

Wiki: nao_vision (last edited 2012-12-29 20:47:48 by Russell Toris)