add noetic test on travis (#700)
[eustf.l] fix bug in ros::create-quaternion-from-rpy (#663)
[roseus/eustf.cpp] convert [mm]->[m] in :set-transform (#649)
Fix check-func variable scope in ros::simple-action-server (#670)
Check for preemption request on test/fibonacci-server.l (#672)
Update advertise-service function documentation (#694)
Fixing a couple comment typos in roseus.l (#677)
fix typo: recieve -> receive (#687)
[roseus] add :groupname in create-timer (#688)
Fix unadvertise service (#680)
Add :groupname option to ros::advertise-service (#679)
[roseus] fix typo in subscribe documentation (#690)
[roseus] Remove duplicated dependency in package.xml (#642)
Fix typo: geoometry -> geometry (#645)
add more info on timeout parameter of wait-for-service (#646)
fix comment typo in actionlib.l (#643)
[eustf.l] add comment to :wait-for-transform (#648)
[eustf.l] fix comment :lookup-transform (#650)
add functions to convert shape_msgs/SolidPrimitive <-> euslisp object (#640)
fix warning message for load-ros-manifest (#638)
add SoundRequest.volume for kinetic (#620)
Return t after calling service in (call-empty-service service) (#621)
- Remove unmatched parenthesis
- Return nil in call-empty-service if service is not ready
- Add timeout in call-empty-service.
add python like AnyMsg support (#631)
add list-param and search-param with test code (#629)
Add command line option to start roseus with gdb (#630)
Allow to load pathnames (#612)
Ignore _connection-header in 'print-ros-msg' (#606)
Remove unmatched parenthesis (#607)
Contributors: Guilherme Affonso, Kei Okada, Naoki Hiraoka, Naoya Yamaguchi, Shingo Kitagawa, Yuto Uchimi
(ros::tf-transform->coords) failed with with geometry_msgs::Transform (#563) * fix when tf-transform->coords receives geometry_msgs::Transform * [test/eustf.l] Add test to check (ros::tf-transform->coords) with geometry_msgs::Transform
[roseus-utils.l]fix eusobj->marker-msg (#555) * load dependent packages if msg/srv is not found in ros::load-ros-manifest * add ros::rospack-depends * roseus is always have roseus/ros/roseus * add debug message when loading manifest/msg/srv files, also more message when we need to avoid using load-ros-manifest * INDIGO: https://github.com/jsk-ros-pkg/jsk_roseus/issues/554
if pkg without msg, need to return no-msg-package JADE/KINETIC: https://github.com/jsk-ros-pkg/jsk_robot/issues/823 package without msg does not have manifest.l
do not load manifest.l when we have source tree, but does not have manifest.l because of missing msg/srv (#554)
add test to check :connection-header (#540) * roseusp.cpp : add :connection-header method * add test to check :connection-header
fix dead locking on accessing rosparam in timer callback (#557) * test-mark-lock.l: add function using mark_lock * roseus: remove mutex_lock / unlock * roseus: add test code for dead locking of mark_lock
add test code for [unexpected behavior if message has property name] #508 (#509) * add test code for #508
add ros::duration-sleep (#549) * test/test-roseus.l : add test for ros::duration-sleep * roseus.cpp/roseus.l : add ros::duration-sleep
Support both AcitonGoal and Goal in :send-goal (#546) * test/simple-client-test.l: fix typo returns -> return * actionlib.l:send-goal : send-goal accepts both ActionGoal and Goal, where Python and C only takes Goal, but original roseus takes ActoinGoal, here we make ActionGoal when Goal is passed as python/c client * send SimpleGoal, not SimpleActionGoal
roseus.cpp: use boost::shared_ptr for ros::Rate (#553)
add test to check numbers in node name (#536) (#552) * Allow numbers on ros::roseus node name * add test to check numbers in node name (#536)
Fix roseus test error, see https://github.com/jsk-ros-pkg/jsk_roseus/pull/545#issuecomment-349224047 (#551) * add more messages, fix for roslaunch 1.12.8, due to //github.com/ros/ros_comm/issues/1097, * print error message when test-rosmaster failed * relax hzerror in test-anonymous.test, ex, https://travis-ci.org/jsk-ros-pkg/jsk_roseus/jobs/313841319 * test-roseus.l: test-master, add comment on tests * test-roseus.l: fix test error on test-master
ros::get-uri returns http://localhost:11311, not http://localhost:11311/, also accept arbitrary order in ros::get-nodes, ros::get-topics tests
Contributors: Yuki Furuta, Guilherme Affonso, Kei Okada, Naoki Hiraoka, Iori Yanokura
euslisp/actionlib.l
roseus/utils
cmake/get_all_depends.py
test
test-simple-client-*500.test: add test to run simple-client with high-speed status
test/test-timer.l: surpress output message
test/test-tf.l: surpress output message
test/test-actionlib.l: surpress output message
test/test-add-two-ints.l use ros-info instead of warning-message to suppress message
test/add-two-ints-{client,server}.l use ros-info instead of warning-message to suppress the message
00x-fibonacci-test-{1,2}.launch: fibonacci_{server,client}.py is not longer avilable, use fibonacci_{server,client}
test/test-genmsg.catkin.test: disable --remove-message test, which does not work on paralllel execution
test/test-genmsg: add debug message
test/test-actionlib.l: :wait-for-results returns nil when no goal has been sent
test/test-actionlib.l: simple-action-client must be a global variable
test/test-actionlib.l: add test to run send-goal twice with difference client instance
roseus/test/test-actionlib.test: re-enable test-actionlib.test, which is disabled since groovy
Contributors: Yuki Furuta, Kamada Hitoshi, Kei Okada, Kentaro Wada, Ryohei Ueda, Shunichi Nozawa
Fix bugs in bool array (https://github.com/jsk-ros-pkg/geneus/issues/38)
New Features
rospack plugins ... `lisp (ros::rospack-plugins "nodelet" "plugin") => (("laser_proc" . "/opt/ros/hydro/share/laser_proc/nodelets.xml") ("velodyne_driver" . "/opt/ros/hydro/share/velodyne_driver/nodelet_velodyne.xml") ("yocs_velocity_smoother" . "/opt/ros/hydro/share/yocs_velocity_smoother/plugins/nodelets.xml") ("jsk_perception" . "/home/lueda/ros/hydro/src/jsk-ros-pkg/jsk_recognition/jsk_perception/jsk_perception_nodelets.xml") ("image_rotate" . "/home/lueda/ros/hydro/src/image_pipeline/image_rotate/nodelet_plugins.xml") ("stereo_image_proc" . "/home/lueda/ros/hydro/src/image_pipeline/stereo_image_proc/nodelet_plugins.xml") ("depth_image_proc" . "/home/lueda/ros/hydro/src/image_pipeline/depth_image_proc/nodelet_plugins.xml") ("kobuki_bumper2pc" . "/opt/ros/hydro/share/kobuki_bumper2pc/plugins/nodelet_plugins.xml") ("kobuki_safety_controller" . "/opt/ros/hydro/share/kobuki_safety_controller/plugins/nodelet_plugins.xml") ("naoqi_sensors" . "/home/lueda/ros/hydro/src/ros_naoqi/naoqi_bridge/naoqi_sensors/naoqicamera_nodelet.xml") ("velodyne_pointcloud" . "/opt/ros/hydro/share/velodyne_pointcloud/nodelets.xml") ("pointcloud_to_laserscan" . "/home/lueda/ros/hydro/src/perception_pcl/pointcloud_to_laserscan/nodelets.xml") ("openni2_camera" . "/opt/ros/hydro/share/openni2_camera/openni2_nodelets.xml") ("resized_image_transport" . "/home/lueda/ros/hydro/src/jsk-ros-pkg/jsk_recognition/resized_image_transport/nodelet.xml") ("image_proc" . "/home/lueda/ros/hydro/src/image_pipeline/image_proc/nodelet_plugins.xml") ("uvc_camera" . "/opt/ros/hydro/share/uvc_camera/nodelet_uvc_camera.xml") ("openni_camera" . "/opt/ros/hydro/share/openni_camera/openni_nodelets.xml") ("yocs_cmd_vel_mux" . "/opt/ros/hydro/share/yocs_cmd_vel_mux/plugins/nodelets.xml") ("pcl_ros" . "/home/lueda/ros/hydro/src/perception_pcl/pcl_ros/pcl_nodelets.xml") ("prosilica_camera" . "/home/lueda/ros/hydro/src/prosilica_driver/prosilica_camera/plugins/nodelet_plugins.xml") ("jsk_topic_tools" . "/home/lueda/ros/hydro/src/jsk-ros-pkg/jsk_common/jsk_topic_tools/jsk_topic_tools_nodelet.xml") ("jsk_pcl_ros" . "/home/lueda/ros/hydro/src/jsk-ros-pkg/jsk_recognition/jsk_pcl_ros/jsk_pcl_nodelets.xml") ("image_view" . "/home/lueda/ros/hydro/src/image_pipeline/image_view/nodelet_plugins.xml") ("nodelet_tutorial_math" . "/opt/ros/hydro/share/nodelet_tutorial_math/nodelet_math.xml") ("imagesift" . "/home/lueda/ros/hydro/src/jsk-ros-pkg/jsk_recognition/imagesift/nodelet.xml")) `
Warning Message
Misc
Contributors: Yuki Furuta, Kamada Hitoshi, Kei Okada, Kentaro Wada, Ryohei Ueda, Shunichi Nozawa
catkin.cmake add rostest to find_package
#14: depend roseus message generation on python message generation. in roseus.cmake, do not take into account the dependencies between messages and packages and just depends roseus message generation on python message generation. The 1st reason is the difference between hydro and groovy. On groovy, genmsg does not craete the targets of foo_generate_messages_py which are already compiled, I mean the packages installed by apt. The 2nd reason is that roseus message generation utilizes rospy and it requires for rospy messages to be available. So this dependencies are required. Namely, the dependency will be like this: parent_pkg +-child_pkg
- +-grandchild_pkg
- +-grandchild_pkg_generate_messages_py
+-euslip targets for grandchild_pkg
Contributors: Ryohei Ueda
roseus/test/test-tf.test: tf2_buffer_server output to screen