Skip to content

Instantly share code, notes, and snippets.

@mikepurvis
Last active December 26, 2015 08:49
Show Gist options
  • Save mikepurvis/7124672 to your computer and use it in GitHub Desktop.
Save mikepurvis/7124672 to your computer and use it in GitHub Desktop.
kf/robot.rosinstall, everything but kingfisher CATKIN_IGNORE'd
-- The C compiler identification is GNU
-- The CXX compiler identification is GNU
-- Check for working C compiler: /usr/bin/gcc
-- Check for working C compiler: /usr/bin/gcc -- works
-- Detecting C compiler ABI info
-- Detecting C compiler ABI info - done
-- Check for working CXX compiler: /usr/bin/c++
-- Check for working CXX compiler: /usr/bin/c++ -- works
-- Detecting CXX compiler ABI info
-- Detecting CXX compiler ABI info - done
-- Using CATKIN_DEVEL_PREFIX: /home/administrator/ros/devel
-- Using CMAKE_PREFIX_PATH: /opt/ros/hydro;/home/administrator/ros/devel
-- This workspace overlays: /opt/ros/hydro;/home/administrator/ros/devel
-- Found PythonInterp: /usr/bin/python (found version "2.7.3")
-- Using Debian Python package layout
-- Using CATKIN_ENABLE_TESTING: ON
-- Call enable_testing()
-- Using CATKIN_TEST_RESULTS_DIR: /home/administrator/ros/build/test_results
-- Looking for include files CMAKE_HAVE_PTHREAD_H
-- Looking for include files CMAKE_HAVE_PTHREAD_H - found
-- Looking for pthread_create in pthreads
-- Looking for pthread_create in pthreads - not found
-- Looking for pthread_create in pthread
-- Looking for pthread_create in pthread - found
-- Found Threads: TRUE
-- Found gtest sources under '/usr/src/gtest': gtests will be built
-- catkin 0.5.71
-- BUILD_SHARED_LIBS is on
-- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
-- ~~ traversing 3 packages in topological order:
-- ~~ - kingfisher_description
-- ~~ - kingfisher_msgs
-- ~~ - kingfisher_teleop
-- ~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~~
-- +++ processing catkin package: 'kingfisher_description'
-- ==> add_subdirectory(kingfisher/kingfisher_description)
-- +++ processing catkin package: 'kingfisher_msgs'
-- ==> add_subdirectory(kingfisher/kingfisher_msgs)
-- kingfisher_msgs: 4 messages, 0 services
-- +++ processing catkin package: 'kingfisher_teleop'
-- ==> add_subdirectory(kingfisher/kingfisher_teleop)
-- Configuring done
-- Generating done
-- Build files have been written to: /home/administrator/ros/build
Scanning dependencies of target kingfisher_msgs_generate_messages_py
Scanning dependencies of target kingfisher_msgs_generate_messages_lisp
[ 7%] [ 15%] Generating Python from MSG kingfisher_msgs/Helm
Generating Lisp code from kingfisher_msgs/Helm.msg
Traceback (most recent call last):
File "/opt/ros/hydro/lib/python2.7/dist-packages/genlisp/genlisp_main.py", line 71, in genmain
retcode = generate_msg(options.package, args[1:], options.outdir, search_path)
File "/opt/ros/hydro/lib/python2.7/dist-packages/genlisp/generate.py", line 720, in generate_msg
generate_msg_from_spec(msg_context, spec, search_path, out_dir, pkg)
File "/opt/ros/hydro/lib/python2.7/dist-packages/genlisp/generate.py", line 751, in generate_msg_from_spec
msgs = msg_list(package, search_path, '.msg')
File "/opt/ros/hydro/lib/python2.7/dist-packages/genlisp/generate.py", line 738, in msg_list
files.extend([f for f in os.listdir(d) if f.endswith(ext)])
OSError: [Errno 2] No such file or directory: '/../msg'
ERROR: [Errno 2] No such file or directory: '/../msg'
make[2]: *** [/home/administrator/ros/devel/share/common-lisp/ros/kingfisher_msgs/msg/Helm.lisp] Error 3
make[1]: *** [kingfisher/kingfisher_msgs/CMakeFiles/kingfisher_msgs_generate_messages_lisp.dir/all] Error 2
make[1]: *** Waiting for unfinished jobs....
[ 23%] [ 30%] Generating Python from MSG kingfisher_msgs/Sense
Generating Python from MSG kingfisher_msgs/Course
[ 38%] Generating Python from MSG kingfisher_msgs/Drive
[ 46%] Generating Python msg __init__.py for kingfisher_msgs
[ 46%] Built target kingfisher_msgs_generate_messages_py
make: *** [all] Error 2
Base path: /home/administrator/ros
Source space: /home/administrator/ros/src
Build space: /home/administrator/ros/build
Devel space: /home/administrator/ros/devel
Install space: /home/administrator/ros/install
####
#### Running command: "cmake /home/administrator/ros/src -DCATKIN_DEVEL_PREFIX=/home/administrator/ros/devel -DCMAKE_INSTALL_PREFIX=/home/administrator/ros/install" in "/home/administrator/ros/build"
####
####
#### Running command: "make -j2 -l2" in "/home/administrator/ros/build"
####
Invoking "make" failed
ii ros-hydro-actionlib 1.10.1-0precise-20130819-2300-+0000 The actionlib stack provides a standardized interface for interfacing with preemptable tasks. Examples of this include moving the base to a target location, performing a laser scan and returning the resulting point cloud, detecting the handle of a door, etc.
ii ros-hydro-actionlib-msgs 1.10.2-0precise-20130819-2249-+0000 actionlib_msgs defines the common messages to interact with an action server and an action client. For full documentation of the actionlib API see the actionlib package.
ii ros-hydro-amcl 1.11.3-0precise-20130820-0839-+0000 amcl is a probabilistic localization system for a robot moving in 2D. It implements the adaptive (or KLD-sampling) Monte Carlo localization approach (as described by Dieter Fox), which uses a particle filter to track the pose of a robot against a known map. This node is derived, with thanks, from Andrew Howard's excellent 'amcl' Player driver.
ii ros-hydro-angles 1.9.9-0precise-20130720-2304-+0000 This package provides a set of simple math utilities to work with angles. The utilities cover simple things like normalizing an angle and conversion between degrees and radians. But even if you're trying to calculate things like the shortest angular distance between two joinst space positions of your robot, but the joint motion is constrained by joint limits, this package is what you need. The code in this packge is stable and well tested. There are no plans for major changes in the near future.
ii ros-hydro-base-local-planner 1.11.3-0precise-20130820-1323-+0000 This package provides implementations of the Trajectory Rollout and Dynamic Window approaches to local robot navigation on a plane. Given a plan to follow and a costmap, the controller produces velocity commands to send to a mobile base. This package supports both holonomic and non-holonomic robots, any robot footprint that can be represented as a convex polygon or circle, and exposes its configuration as ROS parameters that can be set in a launch file. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the nav_core package.
ii ros-hydro-bfl 0.7.0-3precise-20130720-2300-+0000 This package contains a recent version of the Bayesian Filtering Library (BFL), distributed by the Orocos Project. For stability reasons, this package is currently locked to revision 31655 (April 19, 2010), but this revision will be updated on a regular basis to the latest available BFL trunk. This ROS package does not modify BFL in any way, it simply provides a convenient way to download and compile the library, because BFL is not available from an OS package manager. This ROS package compiles BFL with the Boost library for matrix operations and random number generation.
ii ros-hydro-bond 1.7.12-0precise-20130721-0100-+0000 A bond allows two processes, A and B, to know when the other has terminated, either cleanly or by crashing. The bond remains connected until it is either broken explicitly or until a heartbeat times out.
ii ros-hydro-bondcpp 1.7.12-0precise-20130721-0206-+0000 C++ implementation of bond, a mechanism for checking when another process has terminated.
ii ros-hydro-camera-calibration 1.11.1-0precise-20130820-0408-+0000 camera_calibration allows easy calibration of monocular or stereo cameras using a checkerboard calibration target.
ii ros-hydro-camera-calibration-parsers 1.11.0-0precise-20130820-0155-+0000 camera_calibration_parsers contains routines for reading and writing camera calibration parameters.
ii ros-hydro-camera-info-manager 1.11.0-0precise-20130820-0412-+0000 This package provides a C++ interface for camera calibration information. It provides CameraInfo, and handles SetCameraInfo service requests, saving and restoring the camera calibration data.
ii ros-hydro-camera1394 1.9.4-0precise-20130820-0838-+0000 ROS driver for devices supporting the IEEE 1394 Digital Camera (IIDC) protocol. Supports the ROS image_pipeline, using libdc1394 for device access.
ii ros-hydro-carrot-planner 1.11.3-0precise-20130820-1352-+0000 This planner attempts to find a legal place to put a carrot for the robot to follow. It does this by moving back along the vector between the robot and the goal point.
ii ros-hydro-catkin 0.5.71-0precise-20130720-2204-+0000 Low-level build system macros and infrastructure for ROS.
ii ros-hydro-class-loader 0.2.2-0precise-20130721-0005-+0000 The class_loader package is a ROS-independent package for loading plugins during runtime and the foundation of the higher level ROS "pluginlib" library. class_loader utilizes the host operating system's runtime loader to open runtime libraries (e.g. .so/.dll files), introspect the library for exported plugin classes, and allows users to instantiate objects of said exported classes without the explicit declaration (i.e. header file) for those classes.
ii ros-hydro-clear-costmap-recovery 1.11.3-0precise-20130820-1857-+0000 This package provides a recovery behavior for the navigation stack that attempts to clear space by reverting the costmaps used by the navigation stack to the static map outside of a given area.
ii ros-hydro-common-msgs 1.10.2-0precise-20130820-0407-+0000 common_msgs contains messages that are widely used by other ROS packages. These includes messages for actions (actionlib_msgs), diagnostics (diagnostic_msgs), geometric primitives (geometry_msgs), robot navigation (nav_msgs), and common sensors (sensor_msgs), such as laser range finders, cameras, point clouds.
ii ros-hydro-compressed-image-transport 1.8.21-0precise-20131021-0010-+0000 Compressed_image_transport provides a plugin to image_transport for transparently sending images encoded as JPEG or PNG.
ii ros-hydro-console-bridge 0.2.4-1precise-20130720-2314-+0000 Lightweight tool for forwarding output from libraries to other logging systems.
ii ros-hydro-control-toolbox 1.10.3-0precise-20130820-0855-+0000 The control toolbox contains modules that are useful across all controllers.
ii ros-hydro-costmap-2d 1.11.3-0precise-20130820-1049-+0000 This package provides an implementation of a 2D costmap that takes in sensor data from the world, builds a 2D or 3D occupancy grid of the data (depending on whether a voxel based implementation is used), and inflates costs in a 2D costmap based on the occupancy grid and a user specified inflation radius. This package also provides support for map_server based initialization of a costmap, rolling window based costmaps, and parameter based subscription to and configuration of sensor topics.
ii ros-hydro-cpp-common 0.3.16-0precise-20130720-2313-+0000 cpp_common contains C++ code for doing things that are not necessarily ROS related, but are useful for multiple packages. This includes things like the ROS_DEPRECATED and ROS_FORCE_INLINE macros, as well as code for getting backtraces. This package is a component of roscpp.
ii ros-hydro-cv-bridge 1.10.7-0precise-20130820-0156-+0000 This contains CvBridge, which converts between ROS Image messages and OpenCV images.
ii ros-hydro-depth-image-proc 1.11.1-0precise-20130820-1050-+0000 Contains nodelets for processing depth images such as those produced by OpenNI camera. Functions include creating disparity images and point clouds, as well as registering (reprojecting) a depth image into another camera frame.
ii ros-hydro-diagnostic-msgs 1.10.2-0precise-20130819-2257-+0000 This package holds the diagnostic messages which provide the standardized interface for the diagnostic and runtime monitoring systems in ROS. These messages are currently used by the diagnostics Stack, which provides libraries for simple ways to set and access the messages, as well as automated ways to process the diagnostic data. These messages are used for long term logging and will not be changed unless there is a very important reason.
ii ros-hydro-diagnostic-updater 1.8.0-0precise-20130820-0028-+0000 diagnostic_updater contains tools for easily updating diagnostics. it is commonly used in device drivers to keep track of the status of output topics, device status, etc.
ii ros-hydro-dwa-local-planner 1.11.3-0precise-20130820-1353-+0000 This package provides an implementation of the Dynamic Window Approach to local robot navigation on a plane. Given a global plan to follow and a costmap, the local planner produces velocity commands to send to a mobile base. This package supports any robot who's footprint can be represented as a convex polygon or cicrle, and exposes its configuration as ROS parameters that can be set in a launch file. The parameters for this planner are also dynamically reconfigurable. This package's ROS wrapper adheres to the BaseLocalPlanner interface specified in the nav_core package.
ii ros-hydro-dynamic-reconfigure 1.5.32-0precise-20130721-0521-+0000 This unary stack contains the dynamic_reconfigure package which provides a means to change node parameters at any time without having to restart the node.
ii ros-hydro-fake-localization 1.11.3-0precise-20130820-0847-+0000 A ROS node that simply forwards odometry information.
ii ros-hydro-gencpp 0.4.13-0precise-20130721-0006-+0000 C++ ROS message and service generators.
ii ros-hydro-genlisp 0.4.11-0precise-20130721-0007-+0000 Common-Lisp ROS message and service generators.
ii ros-hydro-genmsg 0.4.21-0precise-20130720-2317-+0000 Standalone Python library for generating ROS message and service data structures for various languages.
ii ros-hydro-genpy 0.4.13-0precise-20130721-0006-+0000 Python ROS message and service generators.
ii ros-hydro-geometry-msgs 1.10.2-0precise-20130819-2253-+0000 geometry_msgs provides messages for common geometric primitives such as points, vectors, and poses. These primitives are designed to provide a common data type and facilitate interoperability throughout the system.
ii ros-hydro-image-geometry 1.10.7-0precise-20130820-0155-+0000 `image_geometry` contains C++ and Python libraries for interpreting images geometrically. It interfaces the calibration parameters in sensor_msgs/CameraInfo messages with OpenCV functions such as image rectification, much as cv_bridge interfaces ROS sensor_msgs/Image with OpenCV data types.
ii ros-hydro-image-pipeline 1.11.1-0precise-20130820-1227-+0000 image_pipeline fills the gap between getting raw images from a camera driver and higher-level vision processing.
ii ros-hydro-image-proc 1.11.1-0precise-20130820-0411-+0000 Single image rectification and color processing.
ii ros-hydro-image-rotate 1.11.1-0precise-20130820-0848-+0000 Contains a node that rotates an image stream in a way that minimizes the angle between a vector in some arbitrary frame and a vector in the camera frame. The frame of the outgoing image is published by the node. This node is intended to allow camera images to be visualized in an orientation that is more intuitive than the hardware-constrained orientation of the physical camera. This is particularly helpful, for example, to show images from the PR2's forearm cameras with a consistent up direction, despite the fact that the forearms need to rotate in arbitrary ways during manipulation. It is not recommended to use the output from this node for further computation, as it interpolates the source image, introduces black borders, and does not output a camera_info.
ii ros-hydro-image-transport 1.11.0-0precise-20130820-0156-+0000 image_transport should always be used to subscribe to and publish images. It provides transparent support for transporting images in low-bandwidth compressed formats. Examples (provided by separate plugin packages) include JPEG/PNG compression and Theora streaming video.
ii ros-hydro-image-view 1.11.1-0precise-20130820-0411-+0000 A simple viewer for ROS image topics. Includes a specialized viewer for stereo + disparity images.
ii ros-hydro-joy 1.9.10-0precise-20131015-2137-+0000 ROS driver for a generic Linux joystick. The joy package contains joy_node, a node that interfaces a generic Linux joystick to ROS. This node publishes a "Joy" message, which contains the current state of each one of the joystick's buttons and axes.
ii ros-hydro-kdl-conversions 1.10.6-0precise-20131010-0201-+0000 Conversion functions between KDL and geometry_msgs types.
ii ros-hydro-kdl-parser 1.10.15-0precise-20131015-2029-+0000 The Kinematics and Dynamics Library (KDL) defines a tree structure to represent the kinematic and dynamic parameters of a robot mechanism. kdl_parser provides tools to construct a KDL tree from an XML robot representation in URDF.
ii ros-hydro-kingfisher-avr 0.0.3-0precise Kingfisher AVR Firmware
ii ros-hydro-kingfisher-controller 0.0.2-0precise The kingfisher_controller package
ii ros-hydro-kingfisher-msgs 0.0.2-0precise-20131016-0752-+0000 Provides standard messages specific to Kingfisher, especially for the microcontroller's rosserial interface.
ii ros-hydro-laser-geometry 1.5.11-1precise-20130820-0841-+0000 This package contains a class for converting from a 2D laser scan as defined by sensor_msgs/LaserScan into a point cloud as defined by sensor_msgs/PointCloud or sensor_msgs/PointCloud2. In particular, it contains functionality to account for the skew resulting from moving robots or tilting laser scanners.
ii ros-hydro-map-msgs 0.0.2-0precise-20130820-0153-+0000 This package defines messages commonly used in mapping packages.
ii ros-hydro-map-server 1.11.3-0precise-20130820-0842-+0000 map_server provides the map_server ROS Node, which offers map data as a ROS Service. It also provides the map_saver command-line utility, which allows dynamically generated maps to be saved to file.
ii ros-hydro-message-filters 1.9.47-0precise-20130721-0323-+0000 A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
ii ros-hydro-message-generation 0.2.9-0precise-20130721-0019-+0000 Package modeling the build-time dependencies for generating language bindings of messages.
ii ros-hydro-message-runtime 0.4.11-0precise-20130721-0036-+0000 Package modeling the run-time dependencies for language bindings of messages.
ii ros-hydro-mk 1.10.4-0precise-20130720-2312-+0000 A collection of .mk include files for building ROS architectural elements. Most package authors should use cmake .mk, which calls CMake for the build of the package. The other files in this package are intended for use in exotic situations that mostly arise when importing 3rdparty code.
ii ros-hydro-move-base 1.11.3-0precise-20130820-2320-+0000 The move_base package provides an implementation of an action (see the actionlib package) that, given a goal in the world, will attempt to reach it with a mobile base. The move_base node links together a global and local planner to accomplish its global navigation task. It supports any global planner adhering to the nav_core::BaseGlobalPlanner interface specified in the nav_core package and any local planner adhering to the nav_core::BaseLocalPlanner interface specified in the nav_core package. The move_base node also maintains two costmaps, one for the global planner, and one for a local planner (see the costmap_2d package) that are used to accomplish navigation tasks.
ii ros-hydro-move-base-msgs 1.11.3-0precise-20130819-2345-+0000 Holds the action description and relevant messages for the move_base package
ii ros-hydro-move-slow-and-clear 1.11.3-0precise-20130820-1324-+0000 move_slow_and_clear
ii ros-hydro-nav-core 1.11.3-0precise-20130820-1228-+0000 This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
ii ros-hydro-nav-msgs 1.10.2-0precise-20130819-2342-+0000 nav_msgs defines the common messages used to interact with the navigation stack.
ii ros-hydro-navfn 1.11.3-0precise-20130820-1859-+0000 navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in nav_core.
ii ros-hydro-navigation 1.11.3-0precise-20130820-2348-+0000 A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
ii ros-hydro-nmea-msgs 0.1.0-0precise-20131010-0156-+0000 The nmea_msgs package contains messages related to data in the NMEA format.
ii ros-hydro-nodelet 1.8.0-0precise-20130721-0239-+0000 The nodelet package is designed to provide a way to run multiple algorithms in the same process with zero copy transport between algorithms. This package provides both the nodelet base class needed for implementing a nodelet, as well as the NodeletLoader class used for instantiating nodelets.
ii ros-hydro-nodelet-topic-tools 1.8.0-0precise-20130721-0558-+0000 This package contains common nodelet tools such as a mux, demux and throttle.
ii ros-hydro-opencv2 2.4.6-1precise-20130720-2303-+0000 OpenCV
ii ros-hydro-orocos-kdl 1.1.102-0precise-20131010-0051-+0000 This package contains a recent version of the Kinematics and Dynamics Library (KDL), distributed by the Orocos Project.
ii ros-hydro-pcl 1.7.0-11precise-20130724-0035-+0000 The Point Cloud Library (or PCL) for point cloud processing - development The PCL framework contains numerous state-of-the art algorithms including filtering, feature estimation, surface reconstruction, registration, model fitting and segmentation.
ii ros-hydro-pcl-conversions 0.1.4-0precise-20130820-0415-+0000 Provides conversions from PCL data types and ROS message types
ii ros-hydro-pcl-msgs 0.1.0-0precise-20130820-0159-+0000 Package containing PCL (Point Cloud Library)-related ROS messages.
ii ros-hydro-pcl-ros 1.1.4-0precise-20130820-0842-+0000 PCL (Point Cloud Library) ROS interface stack. PCL-ROS is the preferred bridge for 3D applications involving n-D Point Clouds and 3D geometry processing in ROS.
ii ros-hydro-pluginlib 1.9.21-0precise-20130721-0037-+0000 The pluginlib package provides tools for writing and dynamically loading plugins using the ROS build infrastructure. To work, these tools require plugin providers to register their plugins in the package.xml of their package.
ii ros-hydro-realtime-tools 1.8.1-0precise-20130729-1749-+0000 This package contains a set of tools that can be used from a hard realtime thread, without breaking the realtime behavior. The tools currently only provides the realtime publisher, which makes it possible to publish messages to a ROS topic from a realtime thread. We plan to add a basic implementation of a realtime buffer, to make it possible to get data from a (non-realtime) topic callback into the realtime loop. Once the lockfree buffer is created, the realtime publisher will start using it, which will result in major API changes for the realtime publisher (removal of all lock methods).
ii ros-hydro-robot-pose-ekf 1.11.3-0precise-20130820-0851-+0000 The Robot Pose EKF package is used to estimate the 3D pose of a robot, based on (partial) pose measurements coming from different sources. It uses an extended Kalman filter with a 6D model (3D position and 3D orientation) to combine measurements from wheel odometry, IMU sensor and visual odometry. The basic idea is to offer loosely coupled integration with different sensors, where sensor signals are received as ROS messages.
ii ros-hydro-robot-state-publisher 1.9.9-0precise-20131016-0023-+0000 This package allows you to publish the state of a robot to tf. Once the state gets published, it is available to all components in the system that also use tf. The package takes the joint angles of the robot as input and publishes the 3D poses of the robot links, using a kinematic tree model of the robot. The package can both be used as a library and as a ROS node. This package has been well tested and the code is stable. No major changes are planned in the near future
ii ros-hydro-ros 1.10.4-0precise-20130721-0059-+0000 ROS packaging system
ii ros-hydro-ros-base 1.0.0-s1374415508~precise Meta package for ros-base variant of ROS.
ii ros-hydro-ros-comm 1.9.47-0precise-20130721-0601-+0000 ROS communications-related packages, including core client libraries (roscpp, rospy) and graph introspection tools (rostopic, rosnode, rosservice, rosparam).
ii ros-hydro-rosbag 1.9.47-0precise-20130721-0353-+0000 This is a set of tools for recording from and playing back to ROS topics. It is intended to be high performance and avoids deserialization and reserialization of the messages.
ii ros-hydro-rosbag-migration-rule 1.0.0-0precise-20130816-2158-+0000 This empty package allows to export rosbag migration rule files without depending on rosbag.
ii ros-hydro-rosbash 1.10.4-0precise-20130720-2311-+0000 Assorted shell commands for using ros with bash.
ii ros-hydro-rosboost-cfg 1.10.4-0precise-20130720-2322-+0000 Contains scripts used by the rosboost-cfg tool for determining cflags/lflags/etc. of boost on your system
ii ros-hydro-rosbuild 1.10.4-0precise-20130721-0045-+0000 rosbuild contains scripts for managing the CMake-based build system for ROS.
ii ros-hydro-rosclean 1.10.4-0precise-20130720-2303-+0000 rosclean: cleanup filesystem resources (e.g. log files).
ii ros-hydro-rosconsole 1.9.47-0precise-20130721-0024-+0000 ROS console output library.
ii ros-hydro-rosconsole-bridge 0.3.3-0precise-20131015-1954-+0000 rosconsole_bridge is a package used in conjunction with console_bridge and rosconsole for connecting console_bridge-based logging to rosconsole-based logging.
ii ros-hydro-roscpp 1.9.47-0precise-20130721-0118-+0000 roscpp is a C++ implementation of ROS. It provides a client library that enables C++ programmers to quickly interface with ROS Topics, Services, and Parameters. roscpp is the most widely used ROS client library and is designed to be the high-performance library for ROS.
ii ros-hydro-roscpp-serialization 0.3.16-0precise-20130721-0024-+0000 roscpp_serialization contains the code for serialization as described in MessagesSerializationAndAdaptingTypes. This package is a component of roscpp.
ii ros-hydro-roscpp-traits 0.3.16-0precise-20130721-0018-+0000 roscpp_traits contains the message traits code as described in MessagesTraits. This package is a component of roscpp.
ii ros-hydro-roscreate 1.10.4-0precise-20130720-2239-+0000 roscreate contains a tool that assists in the creation of ROS filesystem resources. It provides: roscreate-pkg, which creates a new package directory, including the appropriate build and manifest files.
ii ros-hydro-rosgraph 1.9.47-0precise-20130720-2308-+0000 rosgraph contains the rosgraph command-line tool, which prints information about the ROS Computation Graph. It also provides an internal library that can be used by graphical tools.
ii ros-hydro-rosgraph-msgs 1.9.47-0precise-20130721-0101-+0000 Messages relating to the ROS Computation Graph. These are generally considered to be low-level messages that end users do not interact with.
ii ros-hydro-roslang 1.10.4-0precise-20130721-0007-+0000 roslang is a common package that all ROS client libraries depend on. This is mainly used to find client libraries (via 'rospack depends-on1 roslang').
ii ros-hydro-roslaunch 1.9.47-0precise-20130721-0239-+0000 roslaunch is a tool for easily launching multiple ROS nodes locally and remotely via SSH, as well as setting parameters on the Parameter Server. It includes options to automatically respawn processes that have already died. roslaunch takes in one or more XML configuration files (with the .launch extension) that specify the parameters to set and nodes to launch, as well as the machines that they should be run on.
ii ros-hydro-roslib 1.10.4-0precise-20130721-0003-+0000 Base dependencies and support libraries for ROS. roslib contains many of the common data structures and tools that are shared across ROS client library implementations.
ii ros-hydro-roslisp 1.9.13-2precise-20130721-0118-+0000 Lisp client library for ROS, the Robot Operating System.
ii ros-hydro-rosmake 1.10.4-0precise-20130720-2308-+0000 rosmake is a ros dependency aware build tool which can be used to build all dependencies in the correct order.
ii ros-hydro-rosmaster 1.9.47-0precise-20130721-0004-+0000 ROS Master implementation.
ii ros-hydro-rosmsg 1.9.47-0precise-20130721-0417-+0000 rosmsg contains two command-line tools: rosmsg and rossrv. rosmsg is a command-line tool for displaying information about ROS Message types. rossrv is a command-line tool for displaying information about ROS Service types.
ii ros-hydro-rosnode 1.9.47-0precise-20130721-0449-+0000 rosnode is a command-line tool for displaying debug information about ROS Nodes, including publications, subscriptions and connections. It also contains an experimental library for retrieving node information. This library is intended for internal use only.
ii ros-hydro-rosout 1.9.47-0precise-20130721-0207-+0000 System-wide logging mechanism for messages sent to the /rosout topic.
ii ros-hydro-rospack 2.1.21-0precise-20130720-2303-+0000 ROS Package Tool
ii ros-hydro-rosparam 1.9.47-0precise-20130721-0004-+0000 rosparam contains the rosparam command-line tool for getting and setting ROS Parameters on the Parameter Server using YAML-encoded files. It also contains an experimental library for using YAML with the Parameter Server. This library is intended for internal use only. rosparam can be invoked within a roslaunch file.
ii ros-hydro-rospy 1.9.47-0precise-20130721-0118-+0000 rospy is a pure Python client library for ROS. The rospy client API enables Python programmers to quickly interface with ROS Topics, Services, and Parameters. The design of rospy favors implementation speed (i.e. developer time) over runtime performance so that algorithms can be quickly prototyped and tested within ROS. It is also ideal for non-critical-path code, such as configuration and initialization code. Many of the ROS tools are written in rospy to take advantage of the type introspection capabilities. Many of the ROS tools, such as rostopic and rosservice, are built on top of rospy.
ii ros-hydro-rosserial-arduino 0.5.4-0precise-20131018-1807-+0000 Libraries and examples for ROSserial usage on Arduino/AVR Platforms.
ii ros-hydro-rosserial-client 0.5.4-0precise-20131018-1757-+0000 Generalized client side source for rosserial.
ii ros-hydro-rosserial-msgs 0.5.4-0precise-20131018-1751-+0000 Messages for automatic topic configuration using rosserial.
ii ros-hydro-rosserial-python 0.5.4-0precise-20131018-1758-+0000 A Python-based implementation of the ROS serial protocol.
ii ros-hydro-rosserial-server 0.5.4-0precise-20131018-1756-+0000 The rosserial_server package
ii ros-hydro-rosservice 1.9.47-0precise-20130721-0447-+0000 rosservice contains the rosservice command-line tool for listing and querying ROS Services. It also contains a Python library for retrieving information about Services and dynamically invoking them. The Python library is experimental and is for internal-use only.
ii ros-hydro-rostest 1.9.47-0precise-20130721-0302-+0000 Integration test suite based on roslaunch that is compatible with xUnit frameworks.
ii ros-hydro-rostime 0.3.16-0precise-20130721-0004-+0000 Time and Duration implementations for C++ libraries, including roscpp.
ii ros-hydro-rostopic 1.9.47-0precise-20130721-0418-+0000 rostopic contains the rostopic command-line tool for displaying debug information about ROS Topics, including publishers, subscribers, publishing rate, and ROS Messages. It also contains an experimental Python library for getting information about and interacting with topics dynamically. This library is for internal-use only as the code API may change, though it does provide examples of how to implement dynamic subscription and publication behaviors in ROS.
ii ros-hydro-rosunit 1.10.4-0precise-20130721-0018-+0000 Unit-testing package for ROS. This is a lower-level library for rostest and handles unit tests, whereas rostest handles integration tests.
ii ros-hydro-roswtf 1.9.47-0precise-20130721-0524-+0000 roswtf is a tool for diagnosing issues with a running ROS system. Think of it as a FAQ implemented in code.
ii ros-hydro-rotate-recovery 1.11.3-0precise-20130820-1353-+0000 This package provides a recovery behavior for the navigation stack that attempts to clear space by performing a 360 degree rotation of the robot.
ii ros-hydro-sensor-msgs 1.10.2-0precise-20130819-2342-+0000 This package defines messages for commonly used sensors, including cameras and scanning laser rangefinders.
ii ros-hydro-serial 1.1.4-0precise-20130720-2323-+0000 Serial is a cross-platform, simple to use library for using serial ports on computers. This library provides a C++, object oriented interface for interacting with RS-232 like devices on Linux and Windows.
ii ros-hydro-shape-msgs 1.10.2-0precise-20130819-2342-+0000 shape_msgs
ii ros-hydro-smclib 1.7.12-0precise-20130720-2259-+0000 The State Machine Compiler (SMC) from http://smc.sourceforge.net/ converts a language-independent description of a state machine into the source code to support that state machine. This package contains the libraries that a compiled state machine depends on, but it does not contain the compiler itself.
ii ros-hydro-std-msgs 0.5.7-0precise-20130721-0045-+0000 Standard ROS Messages including common message types representing primitive data types and other basic message constructs, such as multiarrays. For common, generic robot-specific message types, please see common_msgs.
ii ros-hydro-std-srvs 1.9.47-0precise-20130721-0046-+0000 Common service definitions. Currently just the 'Empty' service.
ii ros-hydro-stereo-image-proc 1.11.1-0precise-20130820-0535-+0000 Stereo and single image rectification and disparity processing.
ii ros-hydro-stereo-msgs 1.10.2-0precise-20130820-0150-+0000 stereo_msgs contains messages specific to stereo processing, such as disparity images.
ii ros-hydro-swiftnav 0.0.4-0precise-20131010-0043-+0000 ROS release of swiftnav library
ii ros-hydro-tf 1.10.5-0precise-20130820-0634-+0000 tf is a package that lets the user keep track of multiple coordinate frames over time. tf maintains the relationship between coordinate frames in a tree structure buffered in time, and lets the user transform points, vectors, etc between any two coordinate frames at any desired point in time.
ii ros-hydro-tf-conversions 1.10.6-0precise-20131015-2325-+0000 This package contains a set of conversion functions to convert common tf datatypes (point, vector, pose, etc) into semantically identical datatypes used by other libraries. The conversion functions make it easier for users of the transform library (tf) to work with the datatype of their choice. Currently this package has support for the Kinematics and Dynamics Library (KDL) and the Eigen matrix library. This package is stable, and will get integrated into tf in the next major release cycle (see roadmap).
ii ros-hydro-tf2 0.4.5-0precise-20130820-0201-+0000 tf2 is the second generation of the transform libraray, which lets the user keep track of multiple coordinate frames over time. tf2 maintains the relationship between coordinate frames in a tree structure buffered in time, and lets the user transform points, vectors, etc between any two coordinate frames at any desired point in time.
ii ros-hydro-tf2-msgs 0.4.5-0precise-20130819-2345-+0000 tf2_msgs
ii ros-hydro-tf2-py 0.4.5-0precise-20130820-0417-+0000 The tf2_py package
ii ros-hydro-tf2-ros 0.4.5-0precise-20130820-0538-+0000 This package contains the ROS bindings for the tf2 library, for both Python and C++.
ii ros-hydro-topic-tools 1.9.47-0precise-20130721-0324-+0000 Tools for directing, throttling, selecting, and otherwise messing with ROS topics at a meta level. None of the programs in this package actually know about the topics whose streams they are altering; instead, these tools deal with messages as generic binary blobs. This means they can be applied to any ROS topic.
ii ros-hydro-trajectory-msgs 1.10.2-0precise-20130819-2343-+0000 trajectory_msgs
ii ros-hydro-um6 0.0.1-1precise-20131017-2122-+0000 The um6 package
ii ros-hydro-urdf 1.10.15-0precise-20131015-2007-+0000 This package contains a C++ parser for the Unified Robot Description Format (URDF), which is an XML format for representing a robot model. The code API of the parser has been through our review process and will remain backwards compatible in future releases.
ii ros-hydro-urdf-parser-plugin 1.10.15-0precise-20131010-0144-+0000 This package contains a C++ base class for URDF parsers.
ii ros-hydro-urdfdom 0.2.8-1precise-20131010-0143-+0000 A library to access URDFs using the DOM model.
ii ros-hydro-urdfdom-headers 0.2.3-1precise-20131010-0132-+0000 C++ Headers for URDF
ii ros-hydro-visualization-msgs 1.10.2-0precise-20130819-2343-+0000 visualization_msgs is a set of messages used by higher level packages, such as rviz, that deal in visualization-specific data. The main messages in visualization_msgs is visualization_msgs/Marker. The marker message is used to send visualization "markers" such as boxes, spheres, arrows, lines, etc. to a visualization environment such as rviz. See the rviz tutorial rviz tutorials for more information.
ii ros-hydro-voxel-grid 1.11.3-0precise-20130721-0208-+0000 voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
ii ros-hydro-xacro 1.8.4-0precise-20131015-2047-+0000 Xacro (XML Macros) Xacro is an XML macro language. With xacro, you can construct shorter and more readable XML files by using macros that expand to larger XML expressions.
ii ros-hydro-xmlrpcpp 1.9.47-0precise-20130721-0004-+0000 XmlRpc++ is a C++ implementation of the XML-RPC protocol. This version is heavily modified from the package available on SourceForge in order to support roscpp's threading model. As such, we are maintaining our own fork.
Sign up for free to join this conversation on GitHub. Already have an account? Sign in to comment