Only released in EOL distros:
Package Summary
Renders a ROS occupancy grid map into a HTML5 canvas element.
- Author: Russell Toris
- License: BSD
- Source: git https://github.com/RobotWebTools/map2djs.git (branch: fuerte-devel)
Package Summary
Renders a ROS occupancy grid map into a HTML5 cavas element.
- Maintainer: Russell Toris <rctoris AT wpi DOT edu>
- Author: Russell Toris <rctoris AT wpi DOT edu>
- License: BSD
- Bug / feature tracker: https://github.com/WPI-RAIL/map2djs/issues
- Source: git https://github.com/RobotWebTools/map2djs.git (branch: groovy-devel)
Deprecated
This is the documentation for the depricated, standalone version of map2djs. This version blazed the trail and helped us establish use cases and applications. However, it is now considered deprecated and is not currently supported.
For the currently maintained version of map2djs, please see ros2djs.
Contents
About
map2djs is a stack that allows for an easy way to render a map (in the form of a nav_msgs/OccupancyGrid message) into an internal HTML5 canvas element. The main widget, Map, listens to a given ROS topic and renders the map internally. By default, the widget will request the nav_msgs/OccupancyGrid message once to save bandwidth; however, an option can be set to allow for continuous streaming. Such an option would be useful if you are using SLAM, for example. |
|
Javascript Files
The following is a list of the Javascript files that come with the map2djs stack.
map.js
map.js contains a single object: Map. This object takes in options that describe features such as the ROS topic where the nav_msgs/OccupancyGrid message comes from.
ros - the ROS node object from the rosjs stack
mapTopic (default: '/map') - the ROS topic to listen for nav_msgs/OccupancyGrid messages from as a string
continuous (default: false) - an optional flag to specify continuous rendering of nav_msgs/OccupancyGrid messages (e.g., if SLAM is being used to generate a map)
Events Emitted
The following is a list of the events emitted in map.js.
Map Events
Map emits the following events via eventemitter.js:
'available' - this event is emitted every time a new nav_msgs/OccupancyGrid has been rendered in the internal canvas.
Client Dependencies
map.js depends on both ros.js from the rosjs stack, as well as eventemitter2.js which can also be found within the rosjs stack.
Server Dependencies
map.js depends on a valid rosbridge v2.0 server running form the rosbridge_suite stack as well as a map being streamed as a nav_msgs/OccupancyGrid message (e.g., from a map_server).
Source Code
To install the map2djs package, you can choose to either install from source, or from the Ubuntu package:
Source
To install from source, execute the following:
git clone https://github.com/RobotWebTools/map2djs.git -b fuerte-devel
Ubuntu Package
To install the Ubuntu package, execute the following:
sudo apt-get install ros-fuerte-map2djs
Afterwards, you can find where the files were installed by executing the following:
roscd map2djs
To install the map2djs package, you can choose to either install from source, or from the Ubuntu package:
Source
To install from source, execute the following:
git clone https://github.com/RobotWebTools/map2djs.git -b groovy-devel
Ubuntu Package
To install the Ubuntu package, execute the following:
sudo apt-get install ros-groovy-map2djs
Afterwards, you can find where the files were installed by executing the following:
roscd map2djs
Tutorials
- No results found.
Support
Please send bug reports to the GitHub Issue Tracker. Feel free to contact me at any point with questions and comments.
|
|
|