Giter Site home page Giter Site logo

joystick_drivers's People

Contributors

130s avatar alab288 avatar clalancette avatar cottsay avatar dawonn avatar dirk-thomas avatar furushchev avatar galou avatar jbohren avatar jbohren-hbr avatar jprod123 avatar ketaro-m avatar kevincontoro avatar lbucklandas avatar mamoung avatar martonmiklos avatar matt-attack avatar mdhorn avatar mikaelarguedas avatar mikeferguson avatar mmwise avatar ms-jagadeeshan avatar mvollrath avatar peci1 avatar psimona avatar rhaschke avatar tylerjw avatar v4hn avatar vrabaud avatar zchen24 avatar

Stargazers

 avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar

Watchers

 avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar  avatar

joystick_drivers's Issues

WiiMote update for sensor_msgs/JoyFeedbackArray (ros-pkg ticket #5044)

I created a patch to make the WiiMote driver support the new sensor_msgs JoyFeedbackArray message and be compatible with feedback like ps3joy as reviewed here: http://www.ros.org/wiki/ps3joy/Reviews/2011-07-05%20ps3joy_msg_Proposal_API_Review_API_Review

I also removed the unneeded message files and updated the test files to test LED and Rumble at once.

trac data:

attribute error in wiimote node (ros-pkg ticket #4892)

from: http://answers.ros.org/question/571/wiimote-walltime-problem

user got this when wiimote failed to pair:
{{{
process[turtle_wii-1]: started with pid [8703]
Press buttons 1 and 2 together to pair (within 6 seconds).
(If no blinking lights, press power button for ~3 seconds.)
No Bluetooth interface found
[FATAL] [WallTime: 1301480233.413341] No Wiimote found to pair with.
Traceback (most recent call last):
File "/opt/ros/diamondback/stacks/joystick_drivers/wiimote/nodes/wiimote_node.py", line 1201, in
rospy.rospy.loginfo("Exiting Wiimote node.")
AttributeError: 'module' object has no attribute 'rospy'
[turtle_wii-1] process has died [pid 8703, exit code 1].
}}}

trac data:

Doc review of cwiid and wiimote by Romain (ros-pkg ticket #3580)

Could you doc review the cwiid and wiimote packages? If you do not think you can have these reviewed by Wednesday evening, please let me know and I will reassign the ticket.

To expedite the process, please make any minor wording corrections directly as you see problems. For more significant changes, please make sure to touch bases with me before making any changes, or just report what you would like changed on the review page.

Documentation pages:
http://www.ros.org/wiki/wiimote
http://www.ros.org/wiki/cwiid

Please post reviews here:
http://www.ros.org/wiki/wiimote/Reviews/Jan_11_2010_Doc_Review
http://www.ros.org/wiki/cwiid/Reviews/Jan_12_2010_Doc_Review

trac data:

Bad test_depend in package.xml

The joystick_drivers package.xml contains test_depends that are redundant with its build_depends, and produces warnings whenever the package.xml is parsed by the current tools:

WARNING(s) in None:

  • The test dependency on "geometry_msgs" is redundant with: build_depend, run_depend
  • The test dependency on "sensor_msgs" is redundant with: build_depend, run_depend
  • The test dependency on "std_msgs" is redundant with: build_depend, run_depend
  • The test dependency on "std_srvs" is redundant with: build_depend, run_depend
  • The test dependency on "rospy" is redundant with: build_depend, run_depend
  • The test dependency on "roslib" is redundant with: build_depend, run_depend
  • The test dependency on "python-numpy" is redundant with: build_depend, run_depend, run_depend
  • The test dependency on "python-cwiid" is redundant with: build_depend, run_depend, run_depend

joystick_drivers broken on oneiric (ros-pkg ticket #5215)

{{{
{-------------------------------------------------------------------------------
make[2]: Entering directory /tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid' make wipe make[3]: Entering directory/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid'
cd build/cwiid-svn && make clean
cd: 1: can't cd to build/cwiid-svn
make[3]: [clean] Error 2 (ignored)
rm -rf /tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/src /tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/cwiid installed
rm -rf build patched
make[3]: Leaving directory /tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid' touch wiped mkdir -p build if [ ! -f cwiid-svn-r201.tar.gz.md5sum ]; then echo "Error: Couldn't find md5sum file cwiid-svn-r201.tar.gz.md5sum" && false; fi rospack find rosbuild/bin/download_checkmd5.py http://pr.willowgarage.com/downloads/cwiid-svn-r201.tar.gz build/cwiid-svn-r201.tar.gzawk {'print $1'} cwiid-svn-r201.tar.gz.md5sum [rosbuild] Downloading http://pr.willowgarage.com/downloads/cwiid-svn-r201.tar.gz to build/cwiid-svn-r201.tar.gz...Done [rosbuild] Checking md5sum on build/cwiid-svn-r201.tar.gz touch -c build/cwiid-svn-r201.tar.gz rm -rf build/cwiid-svn cd build; tar xzf ../build/cwiid-svn-r201.tar.gz patch -d build/cwiid-svn -p0 < cwiid-201.patch; patching file python/Makefile.in touch build/cwiid-svn/unpacked cd build/cwiid-svn && autoreconf -i -s cd build/cwiid-svn && ./configure --disable-ldconfig --prefix=/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/cwiid configure: WARNING: unrecognized options: --disable-ldconfig checking for gcc... gcc checking whether the C compiler works... yes checking for C compiler default output file name... a.out checking for suffix of executables... checking whether we are cross compiling... no checking for suffix of object files... o checking whether we are using the GNU C compiler... yes checking whether gcc accepts -g... yes checking for gcc option to accept ISO C89... none needed checking for gawk... no checking for mawk... mawk checking for flex... flex checking lex output file root... lex.yy checking lex library... -lfl checking whether yytext is a pointer... yes checking for bison... bison -y checking for python... python checking for pthread_create in -lpthread... yes checking for hci_devid in -lbluetooth... yes checking for dlopen in -ldl... yes checking how to run the C preprocessor... gcc -E checking for grep that handles long lines and -e... /bin/grep checking for egrep... /bin/grep -E checking for ANSI C header files... yes checking for sys/types.h... yes checking for sys/stat.h... yes checking for stdlib.h... yes checking for string.h... yes checking for memory.h... yes checking for strings.h... yes checking for inttypes.h... yes checking for stdint.h... yes checking for unistd.h... yes checking for stdint.h... (cached) yes checking bluetooth/bluetooth.h usability... yes checking bluetooth/bluetooth.h presence... yes checking for bluetooth/bluetooth.h... yes checking for bluetooth/l2cap.h... yes checking for bluetooth/hci.h... yes checking linux/input.h usability... yes checking linux/input.h presence... yes checking for linux/input.h... yes checking for linux/uinput.h... yes checking for library containing strerror... none required checking for pkg-config... /usr/bin/pkg-config checking pkg-config is at least version 0.9.0... yes checking for GTK... yes configure: creating ./config.status config.status: creating Makefile config.status: creating defs.mak config.status: creating common/include/lib.mak config.status: creating doc/Makefile config.status: creating man/Makefile config.status: creating libcwiid/Makefile config.status: creating libcwiid/cwiid.pc config.status: creating wmdemo/Makefile config.status: creating wmgui/Makefile config.status: creating wminput/Makefile config.status: creating wminput/plugins/Makefile config.status: creating wminput/plugins/ir_ptr/Makefile config.status: creating wminput/plugins/acc/Makefile config.status: creating wminput/plugins/nunchuk_acc/Makefile config.status: creating wminput/plugins/led/Makefile config.status: creating wminput/plugins/nunchuk_stick2btn/Makefile config.status: creating lswm/Makefile config.status: creating python/Makefile config.status: creating common/include/config.h configure: WARNING: unrecognized options: --disable-ldconfig cd build/cwiid-svn && make -l8 && make install make[3]: Entering directory/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn'
make -C libcwiid
make[4]: Entering directory /tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/libcwiid' make[4]: Leaving directory/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/libcwiid'
make[4]: Entering directory /tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/libcwiid' gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -fpic -c -o bluetooth.o bluetooth.c gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -fpic -c -o command.o command.c gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -fpic -c -o connect.o connect.c gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -fpic -c -o interface.o interface.c gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -fpic -c -o process.o process.c process.c: In function 'process_status': process.c:49:39: warning: unused parameter 'ma' [-Wunused-parameter] process.c: In function 'process_ext': process.c:181:31: warning: unused parameter 'len' [-Wunused-parameter] gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -fpic -c -o state.o state.c gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -fpic -c -o thread.o thread.c gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -fpic -c -o util.o util.c util.c: In function 'cwiid_err_default': util.c:74:40: warning: unused parameter 'wiimote' [-Wunused-parameter] ar rcs libcwiid.a bluetooth.o command.o connect.o interface.o process.o state.o thread.o util.o ln -sf libcwiid.so.1.0 libcwiid.so.1 ln -sf libcwiid.so.1 libcwiid.so gcc -shared -Wl,-soname,libcwiid.so.1 -lbluetooth -lpthread -lrt \ -o libcwiid.so.1.0 bluetooth.o command.o connect.o interface.o process.o state.o thread.o util.o make[4]: Leaving directory/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/libcwiid'
make -C wmgui
make[4]: Entering directory /tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/wmgui' make[4]: Leaving directory/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/wmgui'
make[4]: Entering directory /tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/wmgui' gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -pthread -I/usr/include/gtk-2.0 -I/usr/lib/x86_64-linux-gnu/gtk-2.0/include -I/usr/include/atk-1.0 -I/usr/include/cairo -I/usr/include/gdk-pixbuf-2.0 -I/usr/include/pango-1.0 -I/usr/include/gio-unix-2.0/ -I/usr/include/glib-2.0 -I/usr/lib/x86_64-linux-gnu/glib-2.0/include -I/usr/include/pixman-1 -I/usr/include/freetype2 -I/usr/include/libpng12 -I../libcwiid -c -o main.o main.c main.c: In function 'message': main.c:454:2: warning: format not a string literal and no format arguments [-Wformat-security] main.c: In function 'drawStick_expose_event': main.c:809:67: warning: unused parameter 'event' [-Wunused-parameter] main.c: In function 'cwiid_callback': main.c:1036:4: warning: enumeration value 'CWIID_EXT_BALANCE' not handled in switch [-Wswitch] main.c:1021:69: warning: unused parameter 'timestamp' [-Wunused-parameter] gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -pthread -I/usr/include/gtk-2.0 -I/usr/lib/x86_64-linux-gnu/gtk-2.0/include -I/usr/include/atk-1.0 -I/usr/include/cairo -I/usr/include/gdk-pixbuf-2.0 -I/usr/include/pango-1.0 -I/usr/include/gio-unix-2.0/ -I/usr/include/glib-2.0 -I/usr/lib/x86_64-linux-gnu/glib-2.0/include -I/usr/include/pixman-1 -I/usr/include/freetype2 -I/usr/include/libpng12 -I../libcwiid -c -o interface.o interface.c gcc -g -Wall -W -DHAVE_CONFIG_H -I/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/common/include -pthread -I/usr/include/gtk-2.0 -I/usr/lib/x86_64-linux-gnu/gtk-2.0/include -I/usr/include/atk-1.0 -I/usr/include/cairo -I/usr/include/gdk-pixbuf-2.0 -I/usr/include/pango-1.0 -I/usr/include/gio-unix-2.0/ -I/usr/include/glib-2.0 -I/usr/lib/x86_64-linux-gnu/glib-2.0/include -I/usr/include/pixman-1 -I/usr/include/freetype2 -I/usr/include/libpng12 -I../libcwiid -c -o support.o support.c support.c: In function 'create_pixmap': support.c:77:58: warning: unused parameter 'widget' [-Wunused-parameter] gcc -o wmgui main.o interface.o support.o -L../libcwiid -pthread -lgtk-x11-2.0 -lgdk-x11-2.0 -latk-1.0 -lgio-2.0 -lpangoft2-1.0 -lpangocairo-1.0 -lgdk_pixbuf-2.0 -lcairo -lpango-1.0 -lfreetype -lfontconfig -lgobject-2.0 -lgmodule-2.0 -lgthread-2.0 -lrt -lglib-2.0 -lm -lcwiid main.o: In functionmain':
/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/wmgui/main.c:240: undefined reference to str2ba' /tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/wmgui/main.c:252: undefined reference tostr2ba'
../libcwiid/libcwiid.so: undefined reference to hci_close_dev' ../libcwiid/libcwiid.so: undefined reference tohci_inquiry'
../libcwiid/libcwiid.so: undefined reference to hci_get_route' ../libcwiid/libcwiid.so: undefined reference tohci_read_remote_name'
../libcwiid/libcwiid.so: undefined reference to hci_open_dev' collect2: ld returned 1 exit status make[4]: *** [wmgui] Error 1 make[4]: Leaving directory/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn/wmgui'
make[3]: *** [wmgui] Error 2
make[3]: Leaving directory `/tmp/buildd/ros-electric-joystick-drivers-1.6.3/debian/ros-electric-joystick-drivers/opt/ros/electric/stacks/joystick_drivers/cwiid/build/cwiid-svn'
make[2]: *** [installed] Error 2
-------------------------------------------------------------------------------}
[ rosmake ] Output from build of package cwiid written to:
[ rosmake ] /tmp/buildd/.ros/rosmake/rosmake_output-20111022-012029/cwiid/build_output.log
[rosmake-6] Finished <<< cwiid [FAIL] [ 10.22 seconds ]
}}}

trac data:

Non-existing directories in manifest's cflags export (ros-pkg ticket #4702)

See #3217

joy exports cpp flags in its manifest to directories which don't exist anymore. (Just tested againt the latest cturtle release) The no-longer necessary export flags create lots of warning when building dependant packages e.g. in the Eclipse IDE.

"roswtf --all" lists all affected packages.

trac data:

ps3joy/sixpair should return !=0 exit code when joystick not plugged in (ros-pkg ticket #3967)

{{{
root@alz:/wg/stor2/watts/ros/pkgs/joystick_drivers/ps3joy# bin/sixpair 00:1B:DC:00:04:95
ROS_ROOT is not set! Using default rosconsole configuration values
No controller found on USB busses. Please connect your joystick via USB.
root@alz:/wg/stor2/watts/ros/pkgs/joystick_drivers/ps3joy# echo $?
0
}}}

Should return 1 or something.

trac data:

Doc review of cwiid and wiimote by Romain (ros-pkg ticket #3581)

Could you doc review the cwiid and wiimote packages? If you do not think you can have these reviewed by Wednesday evening, please let me know and I will reassign the ticket.

To expedite the process, please make any minor wording corrections directly as you see problems. For more significant changes, please make sure to touch bases with me before making any changes, or just report what you would like changed on the review page.

Documentation pages:
http://www.ros.org/wiki/wiimote
http://www.ros.org/wiki/cwiid

Please post reviews here:
http://www.ros.org/wiki/wiimote/Reviews/Jan_11_2010_Doc_Review
http://www.ros.org/wiki/cwiid/Reviews/Jan_12_2010_Doc_Review

trac data:

Wii Classic Controller (ros-pkg ticket #4545)

I have made a small change in the wiimote package so it can handle the messages from the Classic Controller if it is attached to the Wiimote.

A new topic "wiimote/classic (joy/Joy)" has been added.
Axes are: Left Joystick X/Y, Right Joystick X/Y.
The buttons order is X, Y, A, B, PLUS, MINUS, LEFT, RIGHT, UP, DOWN, HOME, L, R, ZL, ZR.

trac data:

PS3 joy node needs new button mappings when plugged in (ros-pkg ticket #2640)

Curt noticed that the PS3 joy axis mappings are different when the PS3 is plugged in through the USB connection. They're 8 bit (0-256) over bluetooth, but 16 bit (+/- 32k) over USB.

Blaise, any idea how to fix this? I'd like to auto detect the switch and change the normalization.

trac data:

ps3joy system daemon stops responding on PR2 (ros-pkg ticket #5121)

I've had two occurrences now where teleop_joystick doesn't respond to input until I login to c2 and restart the py3joy system daemon. No obvious error or warning messages in /var/log/ps3joy.log

I am running the version of ps3joy from electric (I think most robots run the version from diamondback).

trac data:

Joystick Tutorials need updated for migration of Joy message to sensor_msgs (ros-pkg ticket #5306)

I've seen at least two questions on ROS Answers regarding issues with following the joystick tutorials and having MD5SUM mismatches because the tutorials (and code that is automatically being displayed on the wiki) refer to joy::Joy, which was moved to sensor_msgs::Joy.

Example question on ROS Answers: http://answers.ros.org/question/3353/learning_joy

The joystick driver tutorials (http://www.ros.org/wiki/joystick_drivers_tutorials) need to be updated to reflect the migration of joy::Joy to sensor_msgs::Joy, since the joy_node has been updated to publish sensor_msgs::Joy and not joy::Joy.

trac data:

Apply patch to allow continuous output stream from ps3joy (ros-pkg ticket #5559)

The ps3joy to joy toolchain will not output new joy messages unless some of the values have changed. With steady hands and an unchanging command, the joy values will trigger command timeouts on many platforms.

One easy way to accomplish continuous outputs is to always output whenever one of the accelerometers or gyroscopes changes by even one increment. In joystick jargon, this would mean to set the axis fuzz and axis flat parameters both to zero. This change would also produce better results when using the controller as a motion measurement device, since you rarely want a deadband in the center of an accelerometer output.

I've attached a patch that adds a new option: '--continuous-output' that will output continuous motion sensor streams, and as a side effect of continuous output, no longer leaves long periods of no messages on the /joy topic.

Once this patch is applied, the documentation should be updated. This patch might even work several ros releases back since the ps3joy.py file is independent of ROS.

trac data:

HW ID not set on joystick driver (ros-pkg ticket #3675)

I'm not sure if we have a HW ID, but we should set this to "" or something.

{{{

diagnostic_updater: No HW_ID was set. This is probably a bug. Please report it. For devices that do not have a HW_ID, set this value to 'none'. This warning only occurs once all diagnostics are OK so it is okay to wait until the device is open before calling setHardwareID.
}}}

trac data:

added deadband parameters to spacenav_node (ros-pkg ticket #5474)

I wanted to be able to hold the spacenav device in a largely-deflected position without having to wiggle it to keep it from broadcasting zeros. I added four params:

'''zero_when_static'''[[BR]]
type: bool[[BR]]
default: true[[BR]]
true gives current (classic) behavior, wherein the spacenav_node broadcasts zeros whenever the spacenav is held in a fixed position (static) for a certain number of polls.

'''static_count_threshold'''[[BR]]
type: int[[BR]]
default: 30[[BR]]
This is the number of polls before it considers the device "static."

'''static_trans_deadband'''[[BR]]
type: float[[BR]]
default: 30[[BR]]
When zero_when_static=false, this is the value that one of three translation components needs to exceed in order to not be zeroed out when the device is static.

'''static_rot_deadband'''[[BR]]
Similar to above, but applies to rotations.

I also added three launchfiles:[[BR]]
classic.launch (current behavior)[[BR]]
no_deadband.launch (no special handling of the device output)

static_deadband.launch (some numbers for the static deadband that seem reasonable)[[BR]]

I've attached a diff and the actual files.

trac data:

Doc review of cwiid and wiimote by Gil (ros-pkg ticket #3582)

Could you doc review the cwiid and wiimote packages? If you do not think you can have these reviewed by Wednesday evening, please let me know and I will reassign the ticket.

To expedite the process, please make any minor wording corrections directly as you see problems. For more significant changes, please make sure to touch bases with me before making any changes, or just report what you would like changed on the review page.

Documentation pages:
http://www.ros.org/wiki/wiimote
http://www.ros.org/wiki/cwiid

Please post reviews here:
http://www.ros.org/wiki/wiimote/Reviews/Jan_11_2010_Doc_Review
http://www.ros.org/wiki/cwiid/Reviews/Jan_12_2010_Doc_Review

trac data:

ps3joy requires sudo, prompt for password.

Add this code to the top of main()'s first try: block and it will prompt for sudo password when required.

# Get Root Privileges
euid = os.geteuid()
if euid != 0:
  args = ['sudo', sys.executable] + sys.argv + [os.environ]
  os.execlpe('sudo', *args)
if euid != 0:
  raise SystemExit("Root Privlages Required.")

Recommend Projects

  • React photo React

    A declarative, efficient, and flexible JavaScript library for building user interfaces.

  • Vue.js photo Vue.js

    ๐Ÿ–– Vue.js is a progressive, incrementally-adoptable JavaScript framework for building UI on the web.

  • Typescript photo Typescript

    TypeScript is a superset of JavaScript that compiles to clean JavaScript output.

  • TensorFlow photo TensorFlow

    An Open Source Machine Learning Framework for Everyone

  • Django photo Django

    The Web framework for perfectionists with deadlines.

  • D3 photo D3

    Bring data to life with SVG, Canvas and HTML. ๐Ÿ“Š๐Ÿ“ˆ๐ŸŽ‰

Recommend Topics

  • javascript

    JavaScript (JS) is a lightweight interpreted programming language with first-class functions.

  • web

    Some thing interesting about web. New door for the world.

  • server

    A server is a program made to process requests and deliver data to clients.

  • Machine learning

    Machine learning is a way of modeling and interpreting data that allows a piece of software to respond intelligently.

  • Game

    Some thing interesting about game, make everyone happy.

Recommend Org

  • Facebook photo Facebook

    We are working to build community through open source technology. NB: members must have two-factor auth.

  • Microsoft photo Microsoft

    Open source projects and samples from Microsoft.

  • Google photo Google

    Google โค๏ธ Open Source for everyone.

  • D3 photo D3

    Data-Driven Documents codes.