Skip to content

Instantly share code, notes, and snippets.

@chadrockey
chadrockey / range_pub.py
Created November 20, 2012 21:57
Python range publisher
#!/usr/bin/env python
import roslib; roslib.load_manifest('rviz')
import rospy
from sensor_msgs.msg import Range
def talker():
pub = rospy.Publisher('range', Range)
rospy.init_node('talker')
ranges = [float('NaN'), 1.0, -float('Inf'), 3.0, float('Inf')]
min_range = 2.0
chadrockey@rlu:/wg/stor5/chadrockey/catkin_ws$ catkin_make
Base path: /wg/stor5/chadrockey/catkin_ws
Source space: /wg/stor5/chadrockey/catkin_ws/src
Build space: /wg/stor5/chadrockey/catkin_ws/build
Devel space: /wg/stor5/chadrockey/catkin_ws/devel
Install space: /wg/stor5/chadrockey/catkin_ws/install
####
#### Running command: "cmake /wg/stor5/chadrockey/catkin_ws/src -DCATKIN_DEVEL_PREFIX=/wg/stor5/chadrockey/catkin_ws/devel -DCMAKE_INSTALL_PREFIX=/wg/stor5/chadrockey/catkin_ws/install" in "/wg/stor5/chadrockey/catkin_ws/build"
####
-- The C compiler identification is GNU
cmake_minimum_required(VERSION 2.8.3)
project(beginner_tutorials)
## Find catkin and system dependencies
## Find catkin and any catkin packages on which
## this package depends at build time
find_package(catkin REQUIRED COMPONENTS roscpp rospy std_msgs)
## System dependencies are found with CMake's conventions
# http://ros.org/doc/groovy/api/catkin/html/user_guide/supposed.html
cmake_minimum_required(VERSION 2.8.3)
project(hokuyo_node)
# Load catkin and all dependencies required for this package
find_package(catkin REQUIRED COMPONENTS roscpp sensor_msgs driver_base self_test diagnostic_updater dynamic_reconfigure)
# Dynamic reconfigure support
generate_dynamic_reconfigure_options(cfg/Hokuyo.cfg)
-- +++ processing catkin package: 'depthimage_to_laserscan'
-- ==> add_subdirectory(depthimage_to_laserscan)
-- dynamic_reconfigure built cfg/Depth.cfg: Generating reconfiguration files for Depth in depthimage_to_laserscan
Wrote header file in /wg/stor5/chadrockey/imu_drivers_catkin/devel/include/depthimage_to_laserscan/DepthConfig.h
-- +++ processing catkin package: 'hokuyo_node'
-- ==> add_subdirectory(hokuyo_node)
-- dynamic_reconfigure built cfg/Hokuyo.cfg: Generating reconfiguration files for Hokuyo in hokuyo_node
-- Boost version: 1.46.1
-- Found the following Boost libraries:
-- thread
@chadrockey
chadrockey / gist:4733787
Created February 7, 2013 20:13
Namespaces in the ROS camera API
Patrick Mihelich
On Sun, Sep 18, 2011 at 10:17 AM, Jack O'Quin <[email protected]> wrote:
On Sat, Sep 17, 2011 at 7:16 PM, Ken Tossell <[email protected]> wrote:
>> cameras
>
> The ROS camera API is pretty consistent in its topic naming, but (last
> I looked) there was no standard topic layout for stereo cameras or
> other camera arrays. Also many of the drivers push their topics under
GestureDetector : [Surface Touch Event] mSweepDown False, mLRSDCnt : -1 mTouchCnt : 9 mFalseSizeCnt:0
GestureDetector : [Surface Touch Event] mSweepDown False, mLRSDCnt : -1 mTouchCnt : 31 mFalseSizeCnt:0
SpannableStringBuilder : SPAN_EXCLUSIVE_EXCLUSIVE spans cannot have a zero length
SpannableStringBuilder : SPAN_EXCLUSIVE_EXCLUSIVE spans cannot have a zero length
GestureDetector : [Surface Touch Event] mSweepDown False, mLRSDCnt : -1 mTouchCnt : 8 mFalseSizeCnt:0
com.github.rosjava.android.hokuyo_publisher.HokuyoPublisher : init - Enter
com.github.rosjava.android.hokuyo_publisher.HokuyoPublisher : init - Exit
AbsListView : Get MotionRecognitionManager
AbsListView : unregisterIRListener() is called
AbsListView : unregisterIRListener() is called
AcmDeviceActivity : <new> - Enter
AcmDeviceActivity : <new> - Exit
HokuyoPublisher : <new> - Enter
HokuyoPublisher : <new> - Exit
SpannableStringBuilder : SPAN_EXCLUSIVE_EXCLUSIVE spans cannot have a zero length
SpannableStringBuilder : SPAN_EXCLUSIVE_EXCLUSIVE spans cannot have a zero length
HokuyoPublisher : init - Enter
HokuyoPublisher : init - Exit
bDeviceDetachedReceiver : USB device removed: /dev/bus/usb/002/002
AcmDeviceActivity : <new> - Enter
AndroidRuntime : FATAL EXCEPTION: main
AndroidRuntime : java.lang.RuntimeException: Unable to start activity ComponentInfo{com.github.rosjava.android.hokuyo_publisher/com.github.rosjava.android.hokuyo_publisher.HokuyoPublisher}: java.lang.IllegalArgumentException: Not all endpoints found.
AndroidRuntime : at android.app.ActivityThread.performLaunchActivity(ActivityThread.java:2249)
AndroidRuntime : at android.app.ActivityThread.handleLaunchActivity(ActivityThread.java:2299)
AndroidRuntime : at android.app.ActivityThread.access$700(ActivityThread.java:154)
AndroidRuntime : at android.app.ActivityThread$H.handleMessage(ActivityThread.java:1284)
AndroidRuntime : at android.os.Handler.dispatchMessage(Handler.java:99)
AndroidRuntime : at android.os.Looper.loop(Looper.java:137)
AndroidRuntime : at android.app.ActivityThread.main(ActivityThread.java:5306)
AndroidRuntime : at java.lang.reflect.Method.invokeNative(Native Method)
bDeviceDetachedReceiver : USB device removed: /dev/bus/usb/002/002
ViewRootImpl : sendUserActionEvent() mView == null
MotionRecognitionManager : .unregisterListener : / listener count = 0->0,
ViewRootImpl : sendUserActionEvent() mView == null
InputEventReceiver : Attempted to finish an input event but the input event receiver has already been disposed.
ViewRootImpl : sendUserActionEvent() mView == null
AcmDeviceActivity : <new> - Enter
AcmDeviceActivity : <new> - Exit
HokuyoPublisher : <new> - Enter
HokuyoPublisher : <new> - Exit